Skip to content

Commit

Permalink
Clean CMake (#49) (#51)
Browse files Browse the repository at this point in the history
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
  • Loading branch information
ahcorde authored Feb 12, 2024
1 parent ded6238 commit 402d868
Show file tree
Hide file tree
Showing 2 changed files with 5 additions and 33 deletions.
27 changes: 3 additions & 24 deletions point_cloud_transport/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -120,32 +120,11 @@ ament_export_targets(export_${PROJECT_NAME})
ament_export_dependencies(message_filters rclcpp sensor_msgs pluginlib tl_expected)

if(BUILD_TESTING)
find_package(ament_cmake_copyright REQUIRED)
find_package(ament_cmake_cppcheck REQUIRED)
find_package(ament_cmake_cpplint REQUIRED)
find_package(ament_cmake_flake8 REQUIRED)
find_package(ament_cmake_lint_cmake REQUIRED)
find_package(ament_cmake_pep257 REQUIRED)
find_package(ament_cmake_uncrustify REQUIRED)
find_package(ament_cmake_xmllint REQUIRED)

ament_copyright(EXCLUDE ${_linter_excludes})
ament_cppcheck(
EXCLUDE ${_linter_excludes}
LANGUAGE c++
)
ament_cpplint(EXCLUDE ${_linter_excludes})
ament_flake8(EXCLUDE ${_linter_excludes})
ament_lint_cmake()
ament_pep257(EXCLUDE ${_linter_excludes})
ament_uncrustify(
EXCLUDE ${_linter_excludes}
LANGUAGE c++
)
ament_xmllint()

find_package(ament_lint_auto REQUIRED)
find_package(ament_cmake_gtest)

ament_lint_auto_find_test_dependencies()

ament_add_gtest(${PROJECT_NAME}-point_cloud_common test/test_point_cloud_common.cpp)
if(TARGET ${PROJECT_NAME}-point_cloud_common)
target_link_libraries(${PROJECT_NAME}-point_cloud_common ${PROJECT_NAME})
Expand Down
11 changes: 2 additions & 9 deletions point_cloud_transport/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -26,15 +26,8 @@
<depend>sensor_msgs</depend>
<depend>tl_expected</depend>

<test_depend>ament_cmake_gtest</test_depend>
<test_depend>ament_cmake_copyright</test_depend>
<test_depend>ament_cmake_cppcheck</test_depend>
<test_depend>ament_cmake_cpplint</test_depend>
<test_depend>ament_cmake_flake8</test_depend>
<test_depend>ament_cmake_lint_cmake</test_depend>
<test_depend>ament_cmake_pep257</test_depend>
<test_depend>ament_cmake_uncrustify</test_depend>
<test_depend>ament_cmake_xmllint</test_depend>
<test_depend>ament_lint_common</test_depend>
<test_depend>ament_lint_auto</test_depend>

<export>
<build_type>ament_cmake</build_type>
Expand Down

0 comments on commit 402d868

Please sign in to comment.