File tree Expand file tree Collapse file tree 5 files changed +7
-4
lines changed Expand file tree Collapse file tree 5 files changed +7
-4
lines changed Original file line number Diff line number Diff line change 5151 <test_depend >ament_lint_common</test_depend >
5252 <test_depend >ament_lint_auto</test_depend >
5353 <test_depend >ament_cmake_gtest</test_depend >
54+ <test_depend >test_msgs</test_depend >
5455
5556 <export >
5657 <build_type >ament_cmake</build_type >
Original file line number Diff line number Diff line change 1+ find_package (test_msgs REQUIRED)
2+
13ament_add_gtest(test_bt_action_node test_bt_action_node.cpp)
2- ament_target_dependencies(test_bt_action_node ${dependencies} )
4+ ament_target_dependencies(test_bt_action_node ${dependencies} test_msgs )
35
46ament_add_gtest(test_action_spin_action test_spin_action.cpp)
57target_link_libraries (test_action_spin_action nav2_spin_action_bt_node)
Original file line number Diff line number Diff line change @@ -12,7 +12,6 @@ find_package(nav_msgs REQUIRED)
1212find_package (rclcpp REQUIRED)
1313find_package (lifecycle_msgs REQUIRED)
1414find_package (rclcpp_action REQUIRED)
15- find_package (test_msgs REQUIRED)
1615find_package (rclcpp_lifecycle REQUIRED)
1716find_package (tf2_geometry_msgs REQUIRED)
1817find_package (bondcpp REQUIRED)
Original file line number Diff line number Diff line change 2424 <depend >bondcpp</depend >
2525 <depend >bond</depend >
2626 <depend >rclcpp_action</depend >
27- <depend >test_msgs</depend >
2827 <depend >rclcpp_lifecycle</depend >
2928 <depend >launch</depend >
3029 <depend >launch_testing_ament_cmake</depend >
3837 <test_depend >launch</test_depend >
3938 <test_depend >launch_testing_ament_cmake</test_depend >
4039 <test_depend >std_srvs</test_depend >
40+ <test_depend >test_msgs</test_depend >
4141 <test_depend >action_msgs</test_depend >
4242 <test_depend >launch_testing_ros</test_depend >
4343 <test_depend >ament_cmake_pytest</test_depend >
Original file line number Diff line number Diff line change @@ -3,7 +3,8 @@ ament_add_gtest(test_execution_timer test_execution_timer.cpp)
33ament_add_gtest(test_node_utils test_node_utils.cpp)
44target_link_libraries (test_node_utils ${library_name} )
55
6- find_package (std_srvs)
6+ find_package (std_srvs REQUIRED)
7+ find_package (test_msgs REQUIRED)
78
89ament_add_gtest(test_service_client test_service_client.cpp)
910ament_target_dependencies(test_service_client std_srvs)
You can’t perform that action at this time.
0 commit comments