37#include <eigen3/Eigen/Eigen>
38#include <kdl/path.hpp>
39#include <kdl/velocityprofile.hpp>
50 moveit_msgs::msg::MoveItErrorCodes::INVALID_MOTION_PLAN);
56 moveit_msgs::msg::MoveItErrorCodes::INVALID_LINK_NAME);
58 moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
83 const std::string& group_name);
88 void extractMotionPlanInfo(
const planning_scene::PlanningSceneConstPtr& scene,
93 trajectory_msgs::msg::JointTrajectory& joint_trajectory)
override;
108 std::unique_ptr<KDL::Path> setPathCIRC(
const MotionPlanInfo& info)
const;
This class combines CartesianLimit and JointLimits into on single class.
This class implements a trajectory generator of arcs in Cartesian space. The arc is specified by a st...
This class is used to extract needed information from motion plan request.
Base class of trajectory generators.
moveit_msgs::msg::MotionPlanRequest MotionPlanRequest
#define CREATE_MOVEIT_ERROR_CODE_EXCEPTION(EXCEPTION_CLASS_NAME, ERROR_CODE)