File tree Expand file tree Collapse file tree 2 files changed +9
-0
lines changed Expand file tree Collapse file tree 2 files changed +9
-0
lines changed Original file line number Diff line number Diff line change @@ -29,6 +29,13 @@ ament_export_dependencies(tf2_ros)
2929
3030if (BUILD_TESTING)
3131 find_package (ament_cmake_gtest REQUIRED)
32+ find_package (ament_lint_auto REQUIRED)
33+
34+ # TODO(ros2/geometry2#259) Remove once headers
35+ # are renamed to .hpp
36+ set (ament_cmake_uncrustify_ADDITIONAL_ARGS --language CPP)
37+ set (ament_cmake_cppcheck_LANGUAGE c++)
38+ ament_lint_auto_find_test_dependencies()
3239
3340 # TODO(ros2/orocos_kinematics_dynamics): reenable when PyKDL is ready to use
3441 #find_package(ament_cmake_pytest REQUIRED)
Original file line number Diff line number Diff line change 2525 <depend >tf2_ros</depend >
2626
2727 <test_depend >ament_cmake_gtest</test_depend >
28+ <test_depend >ament_lint_auto</test_depend >
29+ <test_depend >ament_lint_common</test_depend >
2830 <test_depend >rclcpp</test_depend >
2931
3032 <export >
You can’t perform that action at this time.
0 commit comments