File tree Expand file tree Collapse file tree 2 files changed +1
-2
lines changed Expand file tree Collapse file tree 2 files changed +1
-2
lines changed Original file line number Diff line number Diff line change @@ -44,7 +44,6 @@ install(DIRECTORY include/ DESTINATION include/${PROJECT_NAME})
4444if (BUILD_TESTING)
4545 find_package (ament_cmake_gtest REQUIRED)
4646 find_package (rclcpp REQUIRED)
47- find_package (tf2_msgs REQUIRED)
4847
4948 ament_add_gtest(test_kdl test /test_tf2_kdl.cpp)
5049 target_link_libraries (test_kdl
Original file line number Diff line number Diff line change 1919 <depend >tf2</depend >
2020 <depend >tf2_ros</depend >
2121
22+ <exec_depend >python_orocos_kdl_vendor</exec_depend >
2223 <exec_depend >tf2_ros_py</exec_depend >
2324
2425 <test_depend >ament_cmake_gtest</test_depend >
2526 <test_depend >rclcpp</test_depend >
26- <test_depend >tf2_msgs</test_depend >
2727
2828 <export >
2929 <build_type >ament_cmake</build_type >
You can’t perform that action at this time.
0 commit comments