Skip to content

Commit 2c2eabf

Browse files
doisygGuillaume Doisy
andauthored
target link nav2_ros_common::nav2_ros_common (#5352)
Signed-off-by: Guillaume Doisy <guillaume@dexory.com> Co-authored-by: Guillaume Doisy <guillaume@dexory.com>
1 parent 6c04b6d commit 2c2eabf

File tree

1 file changed

+3
-0
lines changed

1 file changed

+3
-0
lines changed

‎nav2_costmap_2d/CMakeLists.txt‎

Lines changed: 3 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -59,6 +59,7 @@ target_link_libraries(nav2_costmap_2d_core PUBLIC
5959
tf2::tf2
6060
tf2_ros::tf2_ros
6161
tf2_sensor_msgs::tf2_sensor_msgs
62+
nav2_ros_common::nav2_ros_common
6263
)
6364

6465
add_library(layers SHARED
@@ -85,6 +86,7 @@ target_link_libraries(layers PUBLIC
8586
nav2_voxel_grid::voxel_grid
8687
nav2_costmap_2d_core
8788
tf2::tf2
89+
nav2_ros_common::nav2_ros_common
8890
)
8991
target_link_libraries(layers PRIVATE
9092
pluginlib::pluginlib
@@ -122,6 +124,7 @@ target_link_libraries(nav2_costmap_2d_client PUBLIC
122124
nav2_costmap_2d_core
123125
${std_msgs_TARGETS}
124126
tf2::tf2
127+
nav2_ros_common::nav2_ros_common
125128
)
126129

127130
add_executable(nav2_costmap_2d_markers src/costmap_2d_markers.cpp)

0 commit comments

Comments
 (0)