Skip to content

Commit 33e348a

Browse files
JPLDevMasterJPLDevMaster
authored andcommitted
fix(nav2_theta_star_planner): Correct typo in CMakeLists ament_export_dependencies
Signed-off-by: JPLDevMaster <JPLDevMaster> Signed-off-by: JPLDevMaster <joao.penha.lopes@tecnico.ulisboa.pt>
1 parent 627a8b6 commit 33e348a

File tree

1 file changed

+2
-1
lines changed

1 file changed

+2
-1
lines changed

nav2_theta_star_planner/CMakeLists.txt

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -87,7 +87,8 @@ ament_export_libraries(${library_name})
8787
ament_export_dependencies(
8888
geometry_msgs
8989
nav2_core
90-
nav2_costmap_2dnav2_util
90+
nav2_costmap_2d
91+
nav2_util
9192
nav_msgs
9293
rclcpp
9394
rclcpp_lifecycle

0 commit comments

Comments
 (0)