Public Member Functions | |
JoystickMux () | |
void | spin () |
Private Member Functions | |
void | cbJoy (const sensor_msgs::Joy::Ptr msg) |
void | cbTopic (const boost::shared_ptr< topic_tools::ShapeShifter const > &msg, int id) |
Private Attributes | |
bool | advertised_ |
int | interrupt_button_ |
ros::Time | last_joy_msg_ |
ros::NodeHandle | nh_ |
ros::NodeHandle | pnh_ |
ros::Publisher | pub_topic_ |
int | selected_ |
ros::Subscriber | sub_joy_ |
ros::Subscriber | sub_topics_ [2] |
double | timeout_ |
Definition at line 37 of file joystick_mux.cpp.
JoystickMux::JoystickMux | ( | ) | [inline] |
Definition at line 93 of file joystick_mux.cpp.
void JoystickMux::cbJoy | ( | const sensor_msgs::Joy::Ptr | msg | ) | [inline, private] |
Definition at line 51 of file joystick_mux.cpp.
void JoystickMux::cbTopic | ( | const boost::shared_ptr< topic_tools::ShapeShifter const > & | msg, |
int | id | ||
) | [inline, private] |
Definition at line 63 of file joystick_mux.cpp.
void JoystickMux::spin | ( | ) | [inline] |
Definition at line 113 of file joystick_mux.cpp.
bool JoystickMux::advertised_ [private] |
Definition at line 48 of file joystick_mux.cpp.
int JoystickMux::interrupt_button_ [private] |
Definition at line 46 of file joystick_mux.cpp.
ros::Time JoystickMux::last_joy_msg_ [private] |
Definition at line 47 of file joystick_mux.cpp.
ros::NodeHandle JoystickMux::nh_ [private] |
Definition at line 40 of file joystick_mux.cpp.
ros::NodeHandle JoystickMux::pnh_ [private] |
Definition at line 41 of file joystick_mux.cpp.
ros::Publisher JoystickMux::pub_topic_ [private] |
Definition at line 44 of file joystick_mux.cpp.
int JoystickMux::selected_ [private] |
Definition at line 49 of file joystick_mux.cpp.
ros::Subscriber JoystickMux::sub_joy_ [private] |
Definition at line 43 of file joystick_mux.cpp.
ros::Subscriber JoystickMux::sub_topics_[2] [private] |
Definition at line 42 of file joystick_mux.cpp.
double JoystickMux::timeout_ [private] |
Definition at line 45 of file joystick_mux.cpp.