Public Member Functions | Private Member Functions | Private Attributes
katana_tutorials::FollowJointTrajectoryClient Class Reference

#include <follow_joint_trajectory_client.h>

List of all members.

Public Member Functions

 FollowJointTrajectoryClient ()
actionlib::SimpleClientGoalState getState ()
 Returns the current state of the action.
control_msgs::FollowJointTrajectoryGoal makeArmUpTrajectory ()
void startTrajectory (control_msgs::FollowJointTrajectoryGoal goal)
 Sends the command to start a given trajectory.
virtual ~FollowJointTrajectoryClient ()

Private Member Functions

void jointStateCB (const sensor_msgs::JointState::ConstPtr &msg)

Private Attributes

std::vector< double > current_joint_state_
bool got_joint_state_
std::vector< std::string > joint_names_
ros::Subscriber joint_state_sub_
ros::NodeHandle nh_
ros::AsyncSpinner spinner_
TrajClient traj_client_

Detailed Description

Definition at line 22 of file follow_joint_trajectory_client.h.


Constructor & Destructor Documentation

Definition at line 13 of file follow_joint_trajectory_client.cpp.

Definition at line 32 of file follow_joint_trajectory_client.cpp.


Member Function Documentation

Returns the current state of the action.

Definition at line 144 of file follow_joint_trajectory_client.cpp.

void katana_tutorials::FollowJointTrajectoryClient::jointStateCB ( const sensor_msgs::JointState::ConstPtr &  msg) [private]

Definition at line 36 of file follow_joint_trajectory_client.cpp.

control_msgs::FollowJointTrajectoryGoal katana_tutorials::FollowJointTrajectoryClient::makeArmUpTrajectory ( )

Definition at line 71 of file follow_joint_trajectory_client.cpp.

void katana_tutorials::FollowJointTrajectoryClient::startTrajectory ( control_msgs::FollowJointTrajectoryGoal  goal)

Sends the command to start a given trajectory.

Definition at line 64 of file follow_joint_trajectory_client.cpp.


Member Data Documentation

Definition at line 38 of file follow_joint_trajectory_client.h.

Definition at line 37 of file follow_joint_trajectory_client.h.

Definition at line 36 of file follow_joint_trajectory_client.h.

Definition at line 35 of file follow_joint_trajectory_client.h.

Definition at line 33 of file follow_joint_trajectory_client.h.

Definition at line 39 of file follow_joint_trajectory_client.h.

Definition at line 34 of file follow_joint_trajectory_client.h.


The documentation for this class was generated from the following files:


katana_tutorials
Author(s): Martin Günther
autogenerated on Thu Jun 6 2019 21:42:31