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