51 const moveit::core::RobotModelConstPtr& robot_model)
56 std::string msg{
"Specified robot model does not contain specified group \"" };
57 msg.append(group_name).append(
"\"");
58 throw std::invalid_argument(msg);
Interface class to express that a derived class can be converted into a moveit_msgs::msg::Constraints...
moveit::core::RobotModelConstPtr robot_model_
Interface class to express that a derived class can be converted into a moveit_msgs::msg::RobotState.