Skip to content

Commit

Permalink
Removed additional sign multiplication (ros-navigation#3088) (ros-nav…
Browse files Browse the repository at this point in the history
…igation#3126)

(cherry picked from commit ef76b5b)

Co-authored-by: autome <[email protected]>
  • Loading branch information
2 people authored and hodgespodge committed Sep 12, 2022
1 parent 83d592a commit 0aa7342
Showing 1 changed file with 1 addition and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -304,7 +304,7 @@ geometry_msgs::msg::TwistStamped RegulatedPurePursuitController::computeVelocity
costAtPose(pose.pose.position.x, pose.pose.position.y), linear_vel, sign);

// Apply curvature to angular velocity after constraining linear velocity
angular_vel = sign * linear_vel * curvature;
angular_vel = linear_vel * curvature;
}

// Collision checking on this velocity heading
Expand Down

0 comments on commit 0aa7342

Please sign in to comment.