Skip to content

Commit b0af0ad

Browse files
JPLDevMasterSteveMacenski
authored andcommitted
fix(nav2_theta_star_planner): Correct typo in CMakeLists ament_export_dependencies (#5514)
Signed-off-by: JPLDevMaster <[email protected]>
1 parent 72e77bb commit b0af0ad

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
@@ -84,7 +84,8 @@ ament_export_libraries(${library_name})
8484
ament_export_dependencies(
8585
geometry_msgs
8686
nav2_core
87-
nav2_costmap_2dnav2_util
87+
nav2_costmap_2d
88+
nav2_util
8889
nav_msgs
8990
rclcpp
9091
rclcpp_lifecycle

0 commit comments

Comments
 (0)