There was an error while loading. Please reload this page.
1 parent 6c04b6d commit 2c2eabfCopy full SHA for 2c2eabf
nav2_costmap_2d/CMakeLists.txt
@@ -59,6 +59,7 @@ target_link_libraries(nav2_costmap_2d_core PUBLIC
59
tf2::tf2
60
tf2_ros::tf2_ros
61
tf2_sensor_msgs::tf2_sensor_msgs
62
+ nav2_ros_common::nav2_ros_common
63
)
64
65
add_library(layers SHARED
@@ -85,6 +86,7 @@ target_link_libraries(layers PUBLIC
85
86
nav2_voxel_grid::voxel_grid
87
nav2_costmap_2d_core
88
89
90
91
target_link_libraries(layers PRIVATE
92
pluginlib::pluginlib
@@ -122,6 +124,7 @@ target_link_libraries(nav2_costmap_2d_client PUBLIC
122
124
123
125
${std_msgs_TARGETS}
126
127
128
129
130
add_executable(nav2_costmap_2d_markers src/costmap_2d_markers.cpp)
0 commit comments