Public Member Functions | Private Member Functions | Private Attributes | List of all members
katana_tutorials::FollowJointTrajectoryClient Class Reference

#include <follow_joint_trajectory_client.h>

Public Member Functions

 FollowJointTrajectoryClient ()
 
actionlib::SimpleClientGoalState getState ()
 Returns the current state of the action. More...
 
control_msgs::FollowJointTrajectoryGoal makeArmUpTrajectory ()
 
void startTrajectory (control_msgs::FollowJointTrajectoryGoal goal)
 Sends the command to start a given trajectory. More...
 
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

katana_tutorials::FollowJointTrajectoryClient::FollowJointTrajectoryClient ( )

Definition at line 13 of file follow_joint_trajectory_client.cpp.

katana_tutorials::FollowJointTrajectoryClient::~FollowJointTrajectoryClient ( )
virtual

Definition at line 32 of file follow_joint_trajectory_client.cpp.

Member Function Documentation

actionlib::SimpleClientGoalState katana_tutorials::FollowJointTrajectoryClient::getState ( )

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

std::vector<double> katana_tutorials::FollowJointTrajectoryClient::current_joint_state_
private

Definition at line 38 of file follow_joint_trajectory_client.h.

bool katana_tutorials::FollowJointTrajectoryClient::got_joint_state_
private

Definition at line 37 of file follow_joint_trajectory_client.h.

std::vector<std::string> katana_tutorials::FollowJointTrajectoryClient::joint_names_
private

Definition at line 36 of file follow_joint_trajectory_client.h.

ros::Subscriber katana_tutorials::FollowJointTrajectoryClient::joint_state_sub_
private

Definition at line 35 of file follow_joint_trajectory_client.h.

ros::NodeHandle katana_tutorials::FollowJointTrajectoryClient::nh_
private

Definition at line 33 of file follow_joint_trajectory_client.h.

ros::AsyncSpinner katana_tutorials::FollowJointTrajectoryClient::spinner_
private

Definition at line 39 of file follow_joint_trajectory_client.h.

TrajClient katana_tutorials::FollowJointTrajectoryClient::traj_client_
private

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 Fri Jan 3 2020 04:01:14