Public Member Functions | Private Member Functions | Private Attributes | List of all members
JoystickInterrupt Class Reference

Public Member Functions

 JoystickInterrupt ()
 

Private Member Functions

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
 

Private Attributes

int angular_axis2_
 
int angular_axis_
 
double angular_high_speed_ratio_
 
double angular_vel_
 
int high_speed_button_
 
int interrupt_button_
 
geometry_msgs::Twist last_input_twist_
 
ros::Time last_joy_msg_
 
int linear_axis2_
 
int linear_axis_
 
double linear_high_speed_ratio_
 
double linear_vel_
 
int linear_y_axis2_
 
int linear_y_axis_
 
double linear_y_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_
 

Detailed Description

Definition at line 41 of file joystick_interrupt.cpp.

Constructor & Destructor Documentation

◆ JoystickInterrupt()

JoystickInterrupt::JoystickInterrupt ( )
inline

Definition at line 157 of file joystick_interrupt.cpp.

Member Function Documentation

◆ cbJoy()

void JoystickInterrupt::cbJoy ( const sensor_msgs::Joy::Ptr  msg)
inlineprivate

Definition at line 90 of file joystick_interrupt.cpp.

◆ cbTwist()

void JoystickInterrupt::cbTwist ( const geometry_msgs::Twist::Ptr  msg)
inlineprivate

Definition at line 139 of file joystick_interrupt.cpp.

◆ getAxisValue()

float JoystickInterrupt::getAxisValue ( const sensor_msgs::Joy::Ptr &  msg,
const int  axis,
const std::string &  axis_name 
) const
inlineprivate

Definition at line 67 of file joystick_interrupt.cpp.

◆ getJoyValue()

float JoystickInterrupt::getJoyValue ( const sensor_msgs::Joy::Ptr &  msg,
const int  axis,
const int  axis2,
const std::string &  axis_name 
) const
inlineprivate

Definition at line 82 of file joystick_interrupt.cpp.

Member Data Documentation

◆ angular_axis2_

int JoystickInterrupt::angular_axis2_
private

Definition at line 59 of file joystick_interrupt.cpp.

◆ angular_axis_

int JoystickInterrupt::angular_axis_
private

Definition at line 57 of file joystick_interrupt.cpp.

◆ angular_high_speed_ratio_

double JoystickInterrupt::angular_high_speed_ratio_
private

Definition at line 55 of file joystick_interrupt.cpp.

◆ angular_vel_

double JoystickInterrupt::angular_vel_
private

Definition at line 51 of file joystick_interrupt.cpp.

◆ high_speed_button_

int JoystickInterrupt::high_speed_button_
private

Definition at line 63 of file joystick_interrupt.cpp.

◆ interrupt_button_

int JoystickInterrupt::interrupt_button_
private

Definition at line 62 of file joystick_interrupt.cpp.

◆ last_input_twist_

geometry_msgs::Twist JoystickInterrupt::last_input_twist_
private

Definition at line 65 of file joystick_interrupt.cpp.

◆ last_joy_msg_

ros::Time JoystickInterrupt::last_joy_msg_
private

Definition at line 64 of file joystick_interrupt.cpp.

◆ linear_axis2_

int JoystickInterrupt::linear_axis2_
private

Definition at line 58 of file joystick_interrupt.cpp.

◆ linear_axis_

int JoystickInterrupt::linear_axis_
private

Definition at line 56 of file joystick_interrupt.cpp.

◆ linear_high_speed_ratio_

double JoystickInterrupt::linear_high_speed_ratio_
private

Definition at line 54 of file joystick_interrupt.cpp.

◆ linear_vel_

double JoystickInterrupt::linear_vel_
private

Definition at line 50 of file joystick_interrupt.cpp.

◆ linear_y_axis2_

int JoystickInterrupt::linear_y_axis2_
private

Definition at line 61 of file joystick_interrupt.cpp.

◆ linear_y_axis_

int JoystickInterrupt::linear_y_axis_
private

Definition at line 60 of file joystick_interrupt.cpp.

◆ linear_y_vel_

double JoystickInterrupt::linear_y_vel_
private

Definition at line 52 of file joystick_interrupt.cpp.

◆ nh_

ros::NodeHandle JoystickInterrupt::nh_
private

Definition at line 44 of file joystick_interrupt.cpp.

◆ pnh_

ros::NodeHandle JoystickInterrupt::pnh_
private

Definition at line 45 of file joystick_interrupt.cpp.

◆ pub_int_

ros::Publisher JoystickInterrupt::pub_int_
private

Definition at line 49 of file joystick_interrupt.cpp.

◆ pub_twist_

ros::Publisher JoystickInterrupt::pub_twist_
private

Definition at line 48 of file joystick_interrupt.cpp.

◆ sub_joy_

ros::Subscriber JoystickInterrupt::sub_joy_
private

Definition at line 47 of file joystick_interrupt.cpp.

◆ sub_twist_

ros::Subscriber JoystickInterrupt::sub_twist_
private

Definition at line 46 of file joystick_interrupt.cpp.

◆ timeout_

double JoystickInterrupt::timeout_
private

Definition at line 53 of file joystick_interrupt.cpp.


The documentation for this class was generated from the following file:


joystick_interrupt
Author(s): Atsushi Watanabe
autogenerated on Mon Jul 3 2023 02:38:51