Skip to content

Commit 37b5197

Browse files
authored
Update regulated_pure_pursuit_controller.cpp (#2396)
1 parent a25cd43 commit 37b5197

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

nav2_regulated_pure_pursuit_controller/src/regulated_pure_pursuit_controller.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -245,7 +245,7 @@ geometry_msgs::msg::TwistStamped RegulatedPurePursuitController::computeVelocity
245245
// Find look ahead distance and point on path and publish
246246
const double lookahead_dist = getLookAheadDistance(speed);
247247
auto carrot_pose = getLookAheadPoint(lookahead_dist, transformed_plan);
248-
carrot_pub_->publish(std::move(createCarrotMsg(carrot_pose)));
248+
carrot_pub_->publish(createCarrotMsg(carrot_pose));
249249

250250
double linear_vel, angular_vel;
251251

0 commit comments

Comments
 (0)