File tree 2 files changed +3
-3
lines changed
moveit_ros/planning/planning_scene_monitor 2 files changed +3
-3
lines changed Original file line number Diff line number Diff line change @@ -49,6 +49,7 @@ if(BUILD_TESTING)
49
49
test /current_state_monitor_tests.cpp)
50
50
target_link_libraries (current_state_monitor_tests
51
51
moveit_planning_scene_monitor)
52
+
52
53
ament_add_gmock(trajectory_monitor_tests test /trajectory_monitor_tests.cpp)
53
54
target_link_libraries (trajectory_monitor_tests moveit_planning_scene_monitor)
54
55
@@ -58,6 +59,7 @@ if(BUILD_TESTING)
58
59
moveit_planning_scene_monitor)
59
60
ament_target_dependencies(planning_scene_monitor_test moveit_core rclcpp
60
61
moveit_msgs)
61
- add_ros_test(test /launch/planning_scene_monitor.test .py TIMEOUT 30 ARGS
62
+
63
+ add_ros_test(test /launch/planning_scene_monitor.test .py TIMEOUT 90 ARGS
62
64
"test_binary_dir:=${CMAKE_CURRENT_BINARY_DIR} " )
63
65
endif ()
Original file line number Diff line number Diff line change @@ -80,15 +80,13 @@ def generate_test_description():
80
80
81
81
82
82
class TestGTestWaitForCompletion (unittest .TestCase ):
83
- @unittest .skip ("Flaky test on humble, see moveit2#2821" )
84
83
# Waits for test to complete, then waits a bit to make sure result files are generated
85
84
def test_gtest_run_complete (self , psm_gtest ):
86
85
self .proc_info .assertWaitForShutdown (psm_gtest , timeout = 4000.0 )
87
86
88
87
89
88
@launch_testing .post_shutdown_test ()
90
89
class TestGTestProcessPostShutdown (unittest .TestCase ):
91
- @unittest .skip ("Flaky test on humble, see moveit2#2821" )
92
90
# Checks if the test has been completed with acceptable exit codes (successful codes)
93
91
def test_gtest_pass (self , proc_info , psm_gtest ):
94
92
launch_testing .asserts .assertExitCodes (proc_info , process = psm_gtest )
You can’t perform that action at this time.
0 commit comments