Skip to content

Commit

Permalink
Merge branch 'ros-planning:main' into main
Browse files Browse the repository at this point in the history
  • Loading branch information
mosfet80 authored Feb 23, 2024
2 parents 9317160 + 21a45aa commit d569dd5
Show file tree
Hide file tree
Showing 2 changed files with 7 additions and 2 deletions.
5 changes: 5 additions & 0 deletions doc/concepts/hybrid_planning/hybrid_planning.rst
Original file line number Diff line number Diff line change
Expand Up @@ -70,11 +70,16 @@ The diagram below depicts the fundamental plugin types and ROS interfaces that m
The architecture is structured in three ROS component nodes:

* **Hybrid Planning Manager**

* Provides a ROS action for Hybrid Planning requests
* Runs the planning logic and coordinates the planners

* **Global Planner**

* Solves the global planning problem and publishes the solution trajectory

* **Local Planner**

* Processes incoming global trajectory updates
* Solves the local planning problem based on robot state, world and reference trajectory
* Sends position/velocity commands to the robot driver
Expand Down
4 changes: 2 additions & 2 deletions doc/concepts/kinematics.rst
Original file line number Diff line number Diff line change
Expand Up @@ -6,8 +6,8 @@ The Kinematics Plugin
---------------------

MoveIt uses a plugin infrastructure, especially targeted towards allowing users to write their own inverse kinematics algorithms.
Forward kinematics and finding jacobians is integrated within the RobotState class itself.
The default inverse kinematics plugin for MoveIt is configured using the `KDL <https://github.com/orocos/orocos_kinematics_dynamics>`_ numerical jacobian-based solver.
Forward kinematics and finding Jacobians is integrated within the RobotState class itself.
The default inverse kinematics plugin for MoveIt is configured using the `KDL <https://github.com/orocos/orocos_kinematics_dynamics>`_ numerical Jacobian-based solver.
This plugin is automatically configured by the MoveIt Setup Assistant.

******************
Expand Down

0 comments on commit d569dd5

Please sign in to comment.