moveit2
The MoveIt Motion Planning Framework for ROS 2.
Namespaces | Functions
trajectory_tools.cpp File Reference
#include <moveit/trajectory_processing/trajectory_tools.h>
#include <moveit/trajectory_processing/ruckig_traj_smoothing.h>
#include <moveit/trajectory_processing/time_optimal_trajectory_generation.h>
Include dependency graph for trajectory_tools.cpp:

Go to the source code of this file.

Namespaces

 trajectory_processing
 

Functions

bool trajectory_processing::isTrajectoryEmpty (const moveit_msgs::msg::RobotTrajectory &trajectory)
 Checks if a robot trajectory is empty. More...
 
std::size_t trajectory_processing::trajectoryWaypointCount (const moveit_msgs::msg::RobotTrajectory &trajectory)
 Returns the number of waypoints in a robot trajectory. More...
 
bool trajectory_processing::applyTOTGTimeParameterization (robot_trajectory::RobotTrajectory &trajectory, double velocity_scaling_factor, double acceleration_scaling_factor, double path_tolerance=0.1, double resample_dt=0.1, double min_angle_change=0.001)
 Applies time parameterization to a robot trajectory using the Time-Optimal Trajectory Generation (TOTG) algorithm. More...
 
bool trajectory_processing::applyRuckigSmoothing (robot_trajectory::RobotTrajectory &trajectory, double velocity_scaling_factor, double acceleration_scaling_factor, bool mitigate_overshoot=false, double overshoot_threshold=0.01)
 Applies Ruckig smoothing to a robot trajectory. More...