1 #ifndef H_PLAY_MOTION_BUILDER 2 #define H_PLAY_MOTION_BUILDER 7 #include <play_motion_msgs/PlayMotionAction.h> 9 #include <play_motion_builder_msgs/BuildMotionAction.h> 10 #include <play_motion_builder_msgs/RunMotionAction.h> 11 #include <play_motion_builder_msgs/EditMotion.h> 12 #include <play_motion_builder_msgs/StoreMotion.h> 13 #include <play_motion_builder_msgs/ChangeJoints.h> 14 #include <play_motion_builder_msgs/ListJointGroups.h> 52 bool editMotionCb(play_motion_builder_msgs::EditMotion::Request &req,
53 play_motion_builder_msgs::EditMotion::Response &res);
54 bool storeMotionCb(play_motion_builder_msgs::StoreMotion::Request &req,
55 play_motion_builder_msgs::StoreMotion::Response &res);
56 bool changeJointsCb(play_motion_builder_msgs::ChangeJoints::Request &req,
57 play_motion_builder_msgs::ChangeJoints::Response &res);
59 play_motion_builder_msgs::ListJointGroups::Response &res);
bool storeMotionCb(play_motion_builder_msgs::StoreMotion::Request &req, play_motion_builder_msgs::StoreMotion::Response &res)
ros::NodeHandle private_nh_
actionlib::SimpleActionClient< play_motion_msgs::PlayMotionAction > PMClient
bool editMotionCb(play_motion_builder_msgs::EditMotion::Request &req, play_motion_builder_msgs::EditMotion::Response &res)
void motionToROSMsg(play_motion_builder_msgs::Motion &motion)
ros::ServiceServer list_joints_server_
void runMotionPreemptCb()
actionlib::SimpleActionServer< play_motion_builder_msgs::BuildMotionAction > BMServer
std::vector< std::string > extra_joints_
RMServer run_motion_server_
void executeRunMotionCb(const play_motion_builder_msgs::RunMotionGoalConstPtr &goal)
PMClient play_motion_client_
std::string semantic_description_
ros::ServiceServer change_joints_server_
bool changeJointsCb(play_motion_builder_msgs::ChangeJoints::Request &req, play_motion_builder_msgs::ChangeJoints::Response &res)
actionlib::SimpleActionServer< play_motion_builder_msgs::RunMotionAction > RMServer
ros::ServiceServer store_motion_server_
bool listJointGroupsCb(play_motion_builder_msgs::ListJointGroups::Request &req, play_motion_builder_msgs::ListJointGroups::Response &res)
ros::ServiceServer edit_motion_server_
std::string robot_description_
void buildMotionPreemptCb()
std::unique_ptr< Motion > motion_