moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit/planning_scene/planning_scene.h>
#include <eigen3/Eigen/Eigen>
#include <pilz_industrial_motion_planner/trajectory_generation_exceptions.h>
#include <pilz_industrial_motion_planner/trajectory_generator.h>
#include <pilz_industrial_motion_planner/velocity_profile_atrap.h>
Go to the source code of this file.
Classes | |
class | pilz_industrial_motion_planner::TrajectoryGeneratorPTP |
This class implements a point-to-point trajectory generator based on VelocityProfileATrap. More... | |
Namespaces | |
namespace | pilz_industrial_motion_planner |
Functions | |
pilz_industrial_motion_planner::CREATE_MOVEIT_ERROR_CODE_EXCEPTION (PtpVelocityProfileSyncFailed, moveit_msgs::msg::MoveItErrorCodes::FAILURE) | |
pilz_industrial_motion_planner::CREATE_MOVEIT_ERROR_CODE_EXCEPTION (PtpNoIkSolutionForGoalPose, moveit_msgs::msg::MoveItErrorCodes::NO_IK_SOLUTION) | |