| Public Member Functions | |
| control_msgs::FollowJointTrajectoryGoal | armExtensionTrajectory (std_msgs::Float32MultiArray &waypoints) | 
| control_msgs::FollowJointTrajectoryGoal | armExtensionTrajectory () | 
| Generates a simple trajectory with two waypoints, used as an example. | |
| actionlib::SimpleClientGoalState | getState () | 
| Returns the current state of the action. | |
| RobotArm () | |
| Initialize the action client and wait for action server to come up. | |
| void | startTrajectory (control_msgs::FollowJointTrajectoryGoal goal) | 
| Sends the command to start a given trajectory. | |
| ~RobotArm () | |
| Clean up the action client. | |
| Private Attributes | |
| TrajClient * | traj_client_ | 
Definition at line 13 of file trajectory_client.cpp.
| RobotArm::RobotArm | ( | ) |  [inline] | 
Initialize the action client and wait for action server to come up.
Definition at line 22 of file trajectory_client.cpp.
| RobotArm::~RobotArm | ( | ) |  [inline] | 
Clean up the action client.
Definition at line 35 of file trajectory_client.cpp.
| control_msgs::FollowJointTrajectoryGoal RobotArm::armExtensionTrajectory | ( | std_msgs::Float32MultiArray & | waypoints | ) |  [inline] | 
Definition at line 49 of file trajectory_client.cpp.
| control_msgs::FollowJointTrajectoryGoal RobotArm::armExtensionTrajectory | ( | ) |  [inline] | 
Generates a simple trajectory with two waypoints, used as an example.
Note that this trajectory contains two waypoints, joined together as a single trajectory. Alternatively, each of these waypoints could be in its own trajectory - a trajectory can have one or more waypoints depending on the desired application.
Definition at line 104 of file trajectory_client.cpp.
| actionlib::SimpleClientGoalState RobotArm::getState | ( | ) |  [inline] | 
Returns the current state of the action.
Definition at line 196 of file trajectory_client.cpp.
| void RobotArm::startTrajectory | ( | control_msgs::FollowJointTrajectoryGoal | goal | ) |  [inline] | 
Sends the command to start a given trajectory.
Definition at line 41 of file trajectory_client.cpp.
| TrajClient* RobotArm::traj_client_  [private] | 
Definition at line 18 of file trajectory_client.cpp.