Public Member Functions | |
JoystickInterrupt () | |
Private Member Functions | |
void | cbJoy (const sensor_msgs::Joy::Ptr msg) |
void | cbTwist (const geometry_msgs::Twist::Ptr msg) |
Private Attributes | |
int | angular_axis2_ |
int | angular_axis_ |
double | angular_high_speed_ratio_ |
double | angular_vel_ |
int | high_speed_button_ |
int | interrupt_button_ |
ros::Time | last_joy_msg_ |
int | linear_axis2_ |
int | linear_axis_ |
double | linear_high_speed_ratio_ |
double | linear_vel_ |
ros::NodeHandle | nh_ |
ros::NodeHandle | pnh_ |
ros::Publisher | pub_int_ |
ros::Publisher | pub_twist_ |
ros::Subscriber | sub_joy_ |
ros::Subscriber | sub_twist_ |
double | timeout_ |
Definition at line 37 of file joystick_interrupt.cpp.
|
inline |
Definition at line 150 of file joystick_interrupt.cpp.
|
inlineprivate |
Definition at line 59 of file joystick_interrupt.cpp.
|
inlineprivate |
Definition at line 134 of file joystick_interrupt.cpp.
|
private |
Definition at line 54 of file joystick_interrupt.cpp.
|
private |
Definition at line 52 of file joystick_interrupt.cpp.
|
private |
Definition at line 50 of file joystick_interrupt.cpp.
|
private |
Definition at line 47 of file joystick_interrupt.cpp.
|
private |
Definition at line 56 of file joystick_interrupt.cpp.
|
private |
Definition at line 55 of file joystick_interrupt.cpp.
|
private |
Definition at line 57 of file joystick_interrupt.cpp.
|
private |
Definition at line 53 of file joystick_interrupt.cpp.
|
private |
Definition at line 51 of file joystick_interrupt.cpp.
|
private |
Definition at line 49 of file joystick_interrupt.cpp.
|
private |
Definition at line 46 of file joystick_interrupt.cpp.
|
private |
Definition at line 40 of file joystick_interrupt.cpp.
|
private |
Definition at line 41 of file joystick_interrupt.cpp.
|
private |
Definition at line 45 of file joystick_interrupt.cpp.
|
private |
Definition at line 44 of file joystick_interrupt.cpp.
|
private |
Definition at line 43 of file joystick_interrupt.cpp.
|
private |
Definition at line 42 of file joystick_interrupt.cpp.
|
private |
Definition at line 48 of file joystick_interrupt.cpp.