|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Classes | |
| class | IterativeSplineParameterization |
| This class sets the timestamps of a trajectory to enforce velocity, acceleration constraints. Initial/final velocities and accelerations may be specified in the trajectory. Velocity and acceleration limits are specified in the model. More... | |
| class | IterativeParabolicTimeParameterization |
| class | RuckigSmoothing |
| class | PathSegment |
| class | Path |
| class | Trajectory |
| class | TimeOptimalTrajectoryGeneration |
| class | TimeParameterization |
| struct | SingleJointTrajectory |
| class | LinearPathSegment |
| class | CircularPathSegment |
Functions | |
| MOVEIT_CLASS_FORWARD (IterativeParabolicTimeParameterization) | |
| This class modifies the timestamps of a trajectory to respect velocity and acceleration constraints. More... | |
| MOVEIT_CLASS_FORWARD (TimeOptimalTrajectoryGeneration) | |
| MOVEIT_CLASS_FORWARD (TimeParameterization) | |
| Base class for trajectory parameterization algorithms. More... | |
| bool | isTrajectoryEmpty (const moveit_msgs::msg::RobotTrajectory &trajectory) |
| std::size_t | trajectoryWaypointCount (const moveit_msgs::msg::RobotTrajectory &trajectory) |
| void | globalAdjustment (std::vector< SingleJointTrajectory > &t2, robot_trajectory::RobotTrajectory &trajectory, std::vector< double > &time_diff) |
| void trajectory_processing::globalAdjustment | ( | std::vector< SingleJointTrajectory > & | t2, |
| robot_trajectory::RobotTrajectory & | trajectory, | ||
| std::vector< double > & | time_diff | ||
| ) |
Definition at line 584 of file iterative_spline_parameterization.cpp.

| bool trajectory_processing::isTrajectoryEmpty | ( | const moveit_msgs::msg::RobotTrajectory & | trajectory | ) |
Definition at line 41 of file trajectory_tools.cpp.
| trajectory_processing::MOVEIT_CLASS_FORWARD | ( | IterativeParabolicTimeParameterization | ) |
This class modifies the timestamps of a trajectory to respect velocity and acceleration constraints.
| trajectory_processing::MOVEIT_CLASS_FORWARD | ( | TimeOptimalTrajectoryGeneration | ) |
| trajectory_processing::MOVEIT_CLASS_FORWARD | ( | TimeParameterization | ) |
Base class for trajectory parameterization algorithms.
| std::size_t trajectory_processing::trajectoryWaypointCount | ( | const moveit_msgs::msg::RobotTrajectory & | trajectory | ) |
Definition at line 46 of file trajectory_tools.cpp.