Skip to content

Commit 5e3d003

Browse files
Abishalinihenningkayserpac48
authored andcommitted
Enable mdof trajectory execution (moveit#13)
Signed-off-by: Paul Gesel <[email protected]> Co-authored-by: Henning Kayser <[email protected]> Co-authored-by: Paul Gesel <[email protected]>
1 parent 672e0ec commit 5e3d003

File tree

1 file changed

+7
-8
lines changed

1 file changed

+7
-8
lines changed

moveit_ros/planning/planning_scene_monitor/CMakeLists.txt

+7-8
Original file line numberDiff line numberDiff line change
@@ -52,12 +52,11 @@ if(BUILD_TESTING)
5252
ament_add_gmock(trajectory_monitor_tests test/trajectory_monitor_tests.cpp)
5353
target_link_libraries(trajectory_monitor_tests moveit_planning_scene_monitor)
5454

55-
ament_add_gtest_executable(planning_scene_monitor_test
56-
test/planning_scene_monitor_test.cpp)
57-
target_link_libraries(planning_scene_monitor_test
58-
moveit_planning_scene_monitor)
59-
ament_target_dependencies(planning_scene_monitor_test moveit_core rclcpp
60-
moveit_msgs)
61-
add_ros_test(test/launch/planning_scene_monitor.test.py TIMEOUT 30 ARGS
62-
"test_binary_dir:=${CMAKE_CURRENT_BINARY_DIR}")
55+
# Disable test ament_add_gtest_executable(planning_scene_monitor_test
56+
# test/planning_scene_monitor_test.cpp)
57+
# target_link_libraries(planning_scene_monitor_test
58+
# moveit_planning_scene_monitor)
59+
# ament_target_dependencies(planning_scene_monitor_test moveit_core rclcpp
60+
# moveit_msgs) add_ros_test(test/launch/planning_scene_monitor.test.py TIMEOUT
61+
# 30 ARGS "test_binary_dir:=${CMAKE_CURRENT_BINARY_DIR}")
6362
endif()

0 commit comments

Comments
 (0)