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.
typedef boost::shared_ptr<TeleopComponent> Teleop::TeleopComponentPtr [private] |
Definition at line 717 of file joystick_teleop.cpp.
void Teleop::init | ( | ros::NodeHandle & | nh | ) | [inline] |
Definition at line 720 of file joystick_teleop.cpp.
void Teleop::joyCallback | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) | [inline, private] |
Definition at line 800 of file joystick_teleop.cpp.
void Teleop::publish | ( | const ros::Duration & | dt | ) | [inline] |
Definition at line 780 of file joystick_teleop.cpp.
void Teleop::stateCallback | ( | const sensor_msgs::JointStateConstPtr & | msg | ) | [inline, private] |
Definition at line 821 of file joystick_teleop.cpp.
std::vector<TeleopComponentPtr> Teleop::components_ [private] |
Definition at line 849 of file joystick_teleop.cpp.
ros::Subscriber Teleop::joy_sub_ [private] |
Definition at line 853 of file joystick_teleop.cpp.
ros::Time Teleop::last_update_ [private] |
Definition at line 850 of file joystick_teleop.cpp.
sensor_msgs::JointStatePtr Teleop::state_msg_ [private] |
Definition at line 852 of file joystick_teleop.cpp.
boost::mutex Teleop::state_mutex_ [private] |
Definition at line 851 of file joystick_teleop.cpp.
ros::Subscriber Teleop::state_sub_ [private] |
Definition at line 853 of file joystick_teleop.cpp.