26 template <
class StartType,
class GoalType>
57 template <
class StartType,
class GoalType>
63 template <
class StartType,
class GoalType>
69 template <
class StartType,
class GoalType>
75 template <
class StartType,
class GoalType>
81 template <
class StartType,
class GoalType>
87 template <
class StartType,
class GoalType>
93 template <
class StartType,
class GoalType>
100 req.max_velocity_scaling_factor = this->
vel_scale_;
101 req.max_acceleration_scaling_factor = this->
acc_scale_;
103 req.start_state = this->
start_.toMoveitMsgsRobotState();
104 req.goal_constraints.push_back(this->
goal_.toGoalConstraints());
StartType & getStartConfiguration()
Base class for commands storing all general information of a command.
void setGoalConfiguration(GoalType goal)
virtual std::string getPlannerId() const =0
void setStartConfiguration(StartType start)
std::string planning_group_
GoalType & getGoalConfiguration()
moveit_msgs::MotionPlanRequest MotionPlanRequest
virtual planning_interface::MotionPlanRequest toRequest() const override
virtual ~BaseCmd()=default