8 #ifndef FOLLOW_JOINT_TRAJECTORY_CLIENT_H_ 9 #define FOLLOW_JOINT_TRAJECTORY_CLIENT_H_ 12 #include <control_msgs/JointTrajectoryAction.h> 14 #include <sensor_msgs/JointState.h> 15 #include <trajectory_msgs/JointTrajectory.h> 41 void jointStateCB(
const sensor_msgs::JointState::ConstPtr &msg);
ros::AsyncSpinner spinner_
std::vector< std::string > joint_names_
actionlib::SimpleActionClient< control_msgs::FollowJointTrajectoryAction > TrajClient
virtual ~Pr2JointTrajectoryClient()
void startTrajectory(control_msgs::JointTrajectoryGoal goal)
Sends the command to start a given trajectory.
control_msgs::JointTrajectoryGoal makeArmUpTrajectory()
std::vector< double > current_joint_state_
ros::Subscriber joint_state_sub_
Pr2JointTrajectoryClient()
actionlib::SimpleClientGoalState getState()
Returns the current state of the action.
void jointStateCB(const sensor_msgs::JointState::ConstPtr &msg)