|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Use ruckig (https://github.com/pantor/ruckig) to adapt the trajectory to be jerk-constrained and time-optimal. More...


Public Member Functions | |
| AddRuckigTrajectorySmoothing () | |
| std::string | getDescription () const override |
| Get a description of this adapter. More... | |
| void | adapt (const planning_scene::PlanningSceneConstPtr &, const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res) const override |
| Adapt the planning response. More... | |
Public Member Functions inherited from planning_interface::PlanningResponseAdapter | |
| virtual void | initialize (const rclcpp::Node::SharedPtr &node, const std::string ¶meter_namespace) |
| Initialize parameters using the passed Node and parameter namespace. More... | |
Use ruckig (https://github.com/pantor/ruckig) to adapt the trajectory to be jerk-constrained and time-optimal.
Definition at line 52 of file add_ruckig_traj_smoothing.cpp.
|
inline |
Definition at line 55 of file add_ruckig_traj_smoothing.cpp.
|
inlineoverridevirtual |
Adapt the planning response.
| planning_scene | Representation of the environment for the planning |
| req | Motion planning request with a set of constraints |
| res | Motion planning response containing the solution that is adapted. |
Implements planning_interface::PlanningResponseAdapter.
Definition at line 64 of file add_ruckig_traj_smoothing.cpp.
|
inlineoverridevirtual |
Get a description of this adapter.
Implements planning_interface::PlanningResponseAdapter.
Definition at line 59 of file add_ruckig_traj_smoothing.cpp.