Recorder for joint state trajectories. More...
#include <joint_state_recorder.h>

Public Member Functions | |
| JointStateTrajectoryRecorder (const std::string &topic_name) | |
Protected Member Functions | |
| void | jointStateCallback (const sensor_msgs::JointStateConstPtr &joint_state) | 
Protected Attributes | |
| ros::Subscriber | joint_state_subscriber_ | 
Recorder for joint state trajectories.
Definition at line 46 of file joint_state_recorder.h.
| JointStateTrajectoryRecorder::JointStateTrajectoryRecorder | ( | const std::string & | topic_name | ) |  [inline] | 
        
Definition at line 50 of file joint_state_recorder.h.
| void JointStateTrajectoryRecorder::jointStateCallback | ( | const sensor_msgs::JointStateConstPtr & | joint_state | ) |  [inline, protected] | 
        
Definition at line 59 of file joint_state_recorder.h.
Definition at line 72 of file joint_state_recorder.h.