57 RobotConfiguration(
const std::string& group_name,
const moveit::core::RobotModelConstPtr& robot_model);
60 void setRobotModel(moveit::core::RobotModelConstPtr robot_model);
Interface class to express that a derived class can be converted into a moveit_msgs::msg::Constraints...
Class to define robot configuration in space.
void setRobotModel(moveit::core::RobotModelConstPtr robot_model)
void setGroupName(const std::string &group_name)
moveit::core::RobotModelConstPtr robot_model_
std::string getGroupName() const
Interface class to express that a derived class can be converted into a moveit_msgs::msg::RobotState.