Public Member Functions | |
| void | init (ros::NodeHandle &nh) |
| void | publish (const ros::Duration &dt) |
Private Types | |
| typedef boost::shared_ptr< TeleopComponent > | TeleopComponentPtr |
Private Member Functions | |
| void | joyCallback (const sensor_msgs::Joy::ConstPtr &msg) |
| void | stateCallback (const sensor_msgs::JointStateConstPtr &msg) |
Private Attributes | |
| std::vector< TeleopComponentPtr > | components_ |
| ros::Subscriber | joy_sub_ |
| ros::Time | last_update_ |
| sensor_msgs::JointStatePtr | state_msg_ |
| boost::mutex | state_mutex_ |
| ros::Subscriber | state_sub_ |
Definition at line 715 of file joystick_teleop.cpp.
|
private |
Definition at line 717 of file joystick_teleop.cpp.
|
inline |
Definition at line 720 of file joystick_teleop.cpp.
|
inlineprivate |
Definition at line 800 of file joystick_teleop.cpp.
|
inline |
Definition at line 780 of file joystick_teleop.cpp.
|
inlineprivate |
Definition at line 821 of file joystick_teleop.cpp.
|
private |
Definition at line 849 of file joystick_teleop.cpp.
|
private |
Definition at line 853 of file joystick_teleop.cpp.
|
private |
Definition at line 850 of file joystick_teleop.cpp.
|
private |
Definition at line 852 of file joystick_teleop.cpp.
|
private |
Definition at line 851 of file joystick_teleop.cpp.
|
private |
Definition at line 853 of file joystick_teleop.cpp.