File tree Expand file tree Collapse file tree 5 files changed +4
-4
lines changed
nav2_costmap_2d/include/nav2_costmap_2d Expand file tree Collapse file tree 5 files changed +4
-4
lines changed Original file line number Diff line number Diff line change 1515#ifndef NAV2_COSTMAP_2D__PLUGIN_CONTAINER_LAYER_HPP_
1616#define NAV2_COSTMAP_2D__PLUGIN_CONTAINER_LAYER_HPP_
1717
18- #include < Eigen/Dense>
1918#include < cmath>
2019#include < memory>
2120#include < string>
Original file line number Diff line number Diff line change @@ -22,6 +22,7 @@ find_package(tf2_ros REQUIRED)
2222find_package (nav2_ros_common REQUIRED)
2323find_package (yaml_cpp_vendor REQUIRED)
2424find_package (yaml-cpp REQUIRED)
25+ find_package (Eigen3 REQUIRED)
2526
2627pkg_search_module(UUID REQUIRED uuid)
2728
@@ -62,6 +63,7 @@ target_link_libraries(${map_io_library_name} PRIVATE
6263 ${GRAPHICSMAGICKCPP_LIBRARIES}
6364 tf2::tf2
6465 yaml-cpp::yaml-cpp
66+ Eigen3::Eigen
6567)
6668
6769add_library (${library_name} SHARED
@@ -231,7 +233,7 @@ ament_export_libraries(
231233 ${map_io_library_name}
232234 ${vo_library_name}
233235)
234- ament_export_dependencies(nav_msgs nav2_msgs nav2_util rclcpp rclcpp_lifecycle nav2_ros_common)
236+ ament_export_dependencies(nav_msgs nav2_msgs nav2_util rclcpp rclcpp_lifecycle nav2_ros_common Eigen3 )
235237ament_export_targets(${library_name} )
236238
237239ament_package()
Original file line number Diff line number Diff line change 3131 <depend >lifecycle_msgs</depend >
3232 <depend >nav2_ros_common</depend >
3333 <depend >uuid</depend >
34+ <depend >eigen</depend >
3435
3536 <test_depend >ament_lint_common</test_depend >
3637 <test_depend >ament_lint_auto</test_depend >
Original file line number Diff line number Diff line change 2929 <depend >tf2_geometry_msgs</depend >
3030 <depend >tf2_ros</depend >
3131 <depend >visualization_msgs</depend >
32- <depend >eigen3_cmake_module</depend >
3332 <depend >eigen</depend >
3433 <depend >nav2_ros_common</depend >
3534
Original file line number Diff line number Diff line change 2424 <depend >tf2</depend >
2525 <depend >tf2_ros</depend >
2626 <depend >nav2_ros_common</depend >
27- <depend >eigen3_cmake_module</depend >
2827 <depend >eigen</depend >
2928
3029 <test_depend >ament_cmake_gtest</test_depend >
You can’t perform that action at this time.
0 commit comments