We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 922e1c7 commit dad6a39Copy full SHA for dad6a39
nav2_util/test/CMakeLists.txt
@@ -31,4 +31,4 @@ ament_add_gtest(test_twist_subscriber test_twist_subscriber.cpp)
31
target_link_libraries(test_twist_subscriber ${library_name} rclcpp::rclcpp ${geometry_msgs_TARGETS})
32
33
ament_add_gtest(test_path_utils test_path_utils.cpp)
34
-target_link_libraries(test_path_utils ${library_name} ${nav_2d_msgs_TARGETS} ${geometry_msgs_TARGETS})
+target_link_libraries(test_path_utils ${library_name} ${nav_2d_msgs_TARGETS} ${geometry_msgs_TARGETS})
0 commit comments