|
| void | cbJoy (const sensor_msgs::Joy::Ptr msg) |
| |
| void | cbTwist (const geometry_msgs::Twist::Ptr msg) |
| |
| float | getAxisValue (const sensor_msgs::Joy::Ptr &msg, const int axis, const std::string &axis_name) const |
| |
| float | getJoyValue (const sensor_msgs::Joy::Ptr &msg, const int axis, const int axis2, const std::string &axis_name) const |
| |
Definition at line 41 of file joystick_interrupt.cpp.
◆ JoystickInterrupt()
| JoystickInterrupt::JoystickInterrupt |
( |
| ) |
|
|
inline |
◆ cbJoy()
| void JoystickInterrupt::cbJoy |
( |
const sensor_msgs::Joy::Ptr |
msg | ) |
|
|
inlineprivate |
◆ cbTwist()
| void JoystickInterrupt::cbTwist |
( |
const geometry_msgs::Twist::Ptr |
msg | ) |
|
|
inlineprivate |
◆ getAxisValue()
| float JoystickInterrupt::getAxisValue |
( |
const sensor_msgs::Joy::Ptr & |
msg, |
|
|
const int |
axis, |
|
|
const std::string & |
axis_name |
|
) |
| const |
|
inlineprivate |
◆ getJoyValue()
| float JoystickInterrupt::getJoyValue |
( |
const sensor_msgs::Joy::Ptr & |
msg, |
|
|
const int |
axis, |
|
|
const int |
axis2, |
|
|
const std::string & |
axis_name |
|
) |
| const |
|
inlineprivate |
◆ angular_axis2_
| int JoystickInterrupt::angular_axis2_ |
|
private |
◆ angular_axis_
| int JoystickInterrupt::angular_axis_ |
|
private |
◆ angular_high_speed_ratio_
| double JoystickInterrupt::angular_high_speed_ratio_ |
|
private |
◆ angular_vel_
| double JoystickInterrupt::angular_vel_ |
|
private |
◆ high_speed_button_
| int JoystickInterrupt::high_speed_button_ |
|
private |
◆ interrupt_button_
| int JoystickInterrupt::interrupt_button_ |
|
private |
◆ last_input_twist_
| geometry_msgs::Twist JoystickInterrupt::last_input_twist_ |
|
private |
◆ last_joy_msg_
◆ linear_axis2_
| int JoystickInterrupt::linear_axis2_ |
|
private |
◆ linear_axis_
| int JoystickInterrupt::linear_axis_ |
|
private |
◆ linear_high_speed_ratio_
| double JoystickInterrupt::linear_high_speed_ratio_ |
|
private |
◆ linear_vel_
| double JoystickInterrupt::linear_vel_ |
|
private |
◆ linear_y_axis2_
| int JoystickInterrupt::linear_y_axis2_ |
|
private |
◆ linear_y_axis_
| int JoystickInterrupt::linear_y_axis_ |
|
private |
◆ linear_y_vel_
| double JoystickInterrupt::linear_y_vel_ |
|
private |
◆ nh_
◆ pnh_
◆ pub_int_
◆ pub_twist_
◆ sub_joy_
◆ sub_twist_
◆ timeout_
| double JoystickInterrupt::timeout_ |
|
private |
The documentation for this class was generated from the following file: