74                     const moveit::core::RobotModelConstPtr& robot_model);
 
   77  void setJoint(
const size_t index, 
const double value);
 
   78  double getJoint(
const size_t index) 
const;
 
   79  const std::vector<double> 
getJoints() 
const;
 
   93  moveit_msgs::msg::RobotState toMoveitMsgsRobotStateWithoutModel() 
const;
 
   94  moveit_msgs::msg::RobotState toMoveitMsgsRobotStateWithModel() 
const;
 
   96  moveit_msgs::msg::Constraints toGoalConstraintsWithoutModel() 
const;
 
   97  moveit_msgs::msg::Constraints toGoalConstraintsWithModel() 
const;
 
  101  std::vector<double> joints_;