Skip to content

Commit 7c571f8

Browse files
author
Leif Terry
committed
Fix typo.
1 parent 1b6039d commit 7c571f8

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

nav2_mppi_controller/src/controller.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -87,7 +87,7 @@ geometry_msgs::msg::TwistStamped MPPIController::computeVelocityCommands(
8787
nav_msgs::msg::Path transformed_plan = path_handler_.transformPath(robot_pose);
8888

8989
nav2_costmap_2d::Costmap2D * costmap = costmap_ros_->getCostmap();
90-
std::unique_lock<nav2_costmap_2d::Costmap2D::mutex_t> cosmtap_lock(*(costmap->getMutex()));
90+
std::unique_lock<nav2_costmap_2d::Costmap2D::mutex_t> costmap_lock(*(costmap->getMutex()));
9191

9292
geometry_msgs::msg::TwistStamped cmd =
9393
optimizer_.evalControl(robot_pose, robot_speed, transformed_plan, goal_checker);

0 commit comments

Comments
 (0)