Opens, reads from and publishes joystick events. More...
Public Member Functions | |
Joystick () | |
int | main (int argc, char **argv) |
Opens joystick port, reads from port and publishes while node is active. | |
Private Member Functions | |
void | diagnostics (diagnostic_updater::DiagnosticStatusWrapper &stat) |
Publishes diagnostics and status. | |
Private Attributes | |
double | autorepeat_rate_ |
double | coalesce_interval_ |
double | deadzone_ |
diagnostic_updater::Updater | diagnostic_ |
int | event_count_ |
std::string | joy_dev_ |
double | lastDiagTime_ |
ros::NodeHandle | nh_ |
bool | open_ |
ros::Publisher | pub_ |
int | pub_count_ |
Opens, reads from and publishes joystick events.
Definition at line 43 of file joy_node.cpp.
Joystick::Joystick | ( | ) | [inline] |
Definition at line 83 of file joy_node.cpp.
void Joystick::diagnostics | ( | diagnostic_updater::DiagnosticStatusWrapper & | stat | ) | [inline, private] |
Publishes diagnostics and status.
Definition at line 60 of file joy_node.cpp.
int Joystick::main | ( | int | argc, |
char ** | argv | ||
) | [inline] |
Opens joystick port, reads from port and publishes while node is active.
Definition at line 87 of file joy_node.cpp.
double Joystick::autorepeat_rate_ [private] |
Definition at line 50 of file joy_node.cpp.
double Joystick::coalesce_interval_ [private] |
Definition at line 51 of file joy_node.cpp.
double Joystick::deadzone_ [private] |
Definition at line 49 of file joy_node.cpp.
Definition at line 57 of file joy_node.cpp.
int Joystick::event_count_ [private] |
Definition at line 52 of file joy_node.cpp.
std::string Joystick::joy_dev_ [private] |
Definition at line 48 of file joy_node.cpp.
double Joystick::lastDiagTime_ [private] |
Definition at line 55 of file joy_node.cpp.
ros::NodeHandle Joystick::nh_ [private] |
Definition at line 46 of file joy_node.cpp.
bool Joystick::open_ [private] |
Definition at line 47 of file joy_node.cpp.
ros::Publisher Joystick::pub_ [private] |
Definition at line 54 of file joy_node.cpp.
int Joystick::pub_count_ [private] |
Definition at line 53 of file joy_node.cpp.