Movatterモバイル変換


[0]ホーム

URL:


Skip to content

Navigation Menu

Sign in
Appearance settings

Search code, repositories, users, issues, pull requests...

Provide feedback

We read every piece of feedback, and take your input very seriously.

Saved searches

Use saved searches to filter your results more quickly

Sign up
Appearance settings

Commit8568d57

Browse files
committed
Fix missing dependencies
Signed-off-by: Ryan Friedman <ryanfriedman5410+github@gmail.com>
1 parenteceaef4 commit8568d57

File tree

2 files changed

+4
-1
lines changed

2 files changed

+4
-1
lines changed

‎grid_map_costmap_2d/CMakeLists.txt‎

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -7,6 +7,7 @@ find_package(grid_map_cmake_helpers REQUIRED)
77
find_package(grid_map_core REQUIRED)
88
find_package(geometry_msgs REQUIRED)
99
find_package(nav2_costmap_2d REQUIRED)
10+
find_package(rclcpp REQUIRED)
1011
find_package(tf2_ros REQUIRED)
1112
find_package(tf2_geometry_msgs REQUIRED)
1213

@@ -34,9 +35,9 @@ target_link_libraries(${PROJECT_NAME}
3435
grid_map_core::grid_map_core
3536
${geometry_msgs_TARGETS}
3637
${tf2_geometry_msgs_TARGETS}
37-
nav2_costmap_2d::nav2_costmap_2d_core
3838
tf2_ros::tf2_ros
3939
)
40+
ament_target_dependencies(${PROJECT_NAME}INTERFACE nav2_costmap_2d)
4041

4142
target_include_directories(${PROJECT_NAME}
4243
INTERFACE

‎grid_map_costmap_2d/test/CMakeLists.txt‎

Lines changed: 2 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -5,6 +5,8 @@ ament_add_gtest(${PROJECT_NAME}-test
55

66
target_link_libraries(${PROJECT_NAME}-test
77
${PROJECT_NAME}::${PROJECT_NAME}
8+
tf2_ros::tf2_ros
9+
rclcpp::rclcpp
810
)
911

1012
ament_add_gtest(costmap-2d-ros-test

0 commit comments

Comments
 (0)

[8]ページ先頭

©2009-2025 Movatter.jp