Skip to content

Commit

Permalink
fix cmake formatting
Browse files Browse the repository at this point in the history
  • Loading branch information
rhaschke committed Aug 29, 2024
1 parent 7d997d4 commit 226a000
Showing 1 changed file with 2 additions and 3 deletions.
5 changes: 2 additions & 3 deletions moveit_ros/planning/planning_scene_monitor/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -61,10 +61,9 @@ if(BUILD_TESTING)
${MOVEIT_LIB_NAME}
)

ament_add_gtest_executable(planning_scene_monitor_test
test/planning_scene_monitor_test.cpp)
ament_add_gtest_executable(planning_scene_monitor_test test/planning_scene_monitor_test.cpp)
target_link_libraries(planning_scene_monitor_test ${MOVEIT_LIB_NAME})
ament_target_dependencies(planning_scene_monitor_test moveit_core rclcpp moveit_msgs)
add_ros_test(test/launch/planning_scene_monitor.test.py TIMEOUT 30 ARGS
"test_binary_dir:=${CMAKE_CURRENT_BINARY_DIR}")
"test_binary_dir:=${CMAKE_CURRENT_BINARY_DIR}")
endif()

0 comments on commit 226a000

Please sign in to comment.