Skip to content

Commit 4c4fdff

Browse files
SteveMacenskiMarc-Morcos
authored andcommitted
Update README.md (ros-navigation#4114)
Signed-off-by: Steve Macenski <stevenmacenski@gmail.com>
1 parent 8a41c6b commit 4c4fdff

File tree

1 file changed

+2
-2
lines changed

1 file changed

+2
-2
lines changed

nav2_graceful_controller/README.md

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -1,7 +1,7 @@
11
# Graceful Motion Controller
22
The graceful motion controller implements a controller based on the works of Jong Jin Park in "Graceful Navigation for Mobile Robots in Dynamic and Uncertain Environments". (2016). In this implementation, a `motion_target` is set at a distance away from the robot that is exponentially stable to generate a smooth trajectory for the robot to follow.
33

4-
See its [Configuration Guide Page](https://navigation.ros.org/configuration/packages/configuring-graceful-motion.html) for additional parameter descriptions.
4+
See its [Configuration Guide Page](https://navigation.ros.org/configuration/packages/configuring-graceful-motion-controller.html) for additional parameter descriptions.
55

66
## Smooth control law
77
The smooth control law is a pose-following kinematic control law that generates a smooth and confortable trajectory for the robot to follow. It is Lyapunov-based feedback control law made of three components:
@@ -39,4 +39,4 @@ The smooth control law is a pose-following kinematic control law that generates
3939
| `transformed_global_plan` | `nav_msgs/Path` | The global plan transformed into the robot frame. |
4040
| `local_plan` | `nav_msgs/Path` | The local plan generated by appliyng iteratively the control law upon a set of motion targets along the global plan. |
4141
| `motion_target` | `geometry_msgs/PointStamped` | The current motion target used by the controller to compute the velocity commands. |
42-
| `slowdown` | `visualization_msgs/Marker` | A flat circle marker of radius slowdown_radius around the motion target. |
42+
| `slowdown` | `visualization_msgs/Marker` | A flat circle marker of radius slowdown_radius around the motion target. |

0 commit comments

Comments
 (0)