Public Member Functions | |
JoystickInterruptTest () | |
void | publishCmdVel (const float lin, const float ang) |
void | publishJoy (const int button, const int high_speed, const float lin0, const float ang0, const float lin1, const float ang1) |
Protected Member Functions | |
void | cbCmdVel (const geometry_msgs::Twist::ConstPtr &msg) |
Protected Attributes | |
geometry_msgs::Twist::ConstPtr | cmd_vel_ |
ros::NodeHandle | nh_ |
ros::Publisher | pub_cmd_vel_ |
ros::Publisher | pub_joy_ |
ros::Subscriber | sub_cmd_vel_ |
Definition at line 36 of file test_joystick_interrupt.cpp.
JoystickInterruptTest::JoystickInterruptTest | ( | ) | [inline] |
Definition at line 52 of file test_joystick_interrupt.cpp.
void JoystickInterruptTest::cbCmdVel | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) | [inline, protected] |
Definition at line 46 of file test_joystick_interrupt.cpp.
void JoystickInterruptTest::publishCmdVel | ( | const float | lin, |
const float | ang | ||
) | [inline] |
Definition at line 59 of file test_joystick_interrupt.cpp.
void JoystickInterruptTest::publishJoy | ( | const int | button, |
const int | high_speed, | ||
const float | lin0, | ||
const float | ang0, | ||
const float | lin1, | ||
const float | ang1 | ||
) | [inline] |
Definition at line 68 of file test_joystick_interrupt.cpp.
geometry_msgs::Twist::ConstPtr JoystickInterruptTest::cmd_vel_ [protected] |
Definition at line 44 of file test_joystick_interrupt.cpp.
ros::NodeHandle JoystickInterruptTest::nh_ [protected] |
Definition at line 39 of file test_joystick_interrupt.cpp.
ros::Publisher JoystickInterruptTest::pub_cmd_vel_ [protected] |
Definition at line 40 of file test_joystick_interrupt.cpp.
ros::Publisher JoystickInterruptTest::pub_joy_ [protected] |
Definition at line 41 of file test_joystick_interrupt.cpp.
ros::Subscriber JoystickInterruptTest::sub_cmd_vel_ [protected] |
Definition at line 42 of file test_joystick_interrupt.cpp.