moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Public Member Functions | List of all members
default_planning_response_adapters::AddRuckigTrajectorySmoothing Class Reference

Use ruckig (https://github.com/pantor/ruckig) to adapt the trajectory to be jerk-constrained and time-optimal. More...

Inheritance diagram for default_planning_response_adapters::AddRuckigTrajectorySmoothing:
Inheritance graph
[legend]
Collaboration diagram for default_planning_response_adapters::AddRuckigTrajectorySmoothing:
Collaboration graph
[legend]

Public Member Functions

 AddRuckigTrajectorySmoothing ()
 
std::string getDescription () const override
 Get a description of this adapter.
 
void adapt (const planning_scene::PlanningSceneConstPtr &, const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res) const override
 Adapt the planning response.
 
- Public Member Functions inherited from planning_interface::PlanningResponseAdapter
virtual void initialize (const rclcpp::Node::SharedPtr &node, const std::string &parameter_namespace)
 Initialize parameters using the passed Node and parameter namespace.
 

Detailed Description

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.

Constructor & Destructor Documentation

◆ AddRuckigTrajectorySmoothing()

default_planning_response_adapters::AddRuckigTrajectorySmoothing::AddRuckigTrajectorySmoothing ( )
inline

Definition at line 55 of file add_ruckig_traj_smoothing.cpp.

Member Function Documentation

◆ adapt()

void default_planning_response_adapters::AddRuckigTrajectorySmoothing::adapt ( const planning_scene::PlanningSceneConstPtr &  planning_scene,
const planning_interface::MotionPlanRequest req,
planning_interface::MotionPlanResponse res 
) const
inlineoverridevirtual

Adapt the planning response.

Parameters
planning_sceneRepresentation of the environment for the planning
reqMotion planning request with a set of constraints
resMotion planning response containing the solution that is adapted.

Implements planning_interface::PlanningResponseAdapter.

Definition at line 64 of file add_ruckig_traj_smoothing.cpp.

Here is the call graph for this function:

◆ getDescription()

std::string default_planning_response_adapters::AddRuckigTrajectorySmoothing::getDescription ( ) const
inlineoverridevirtual

Get a description of this adapter.

Returns
Returns a short string that identifies the planning response adapter

Implements planning_interface::PlanningResponseAdapter.

Definition at line 59 of file add_ruckig_traj_smoothing.cpp.

Here is the caller graph for this function:

The documentation for this class was generated from the following file: