Public Member Functions | |
RB1TorsoPad () | |
void | Update () |
Private Member Functions | |
void | padCallback (const sensor_msgs::Joy::ConstPtr &joy) |
Private Attributes | |
int | axis_linear_z_ |
int | axis_pan_ |
int | axis_tilt_ |
bool | bRegisteredButtonEvent [DEFAULT_NUM_OF_BUTTONS] |
Pointer to a vector for controlling the event when pushing the buttons. | |
std::string | cmd_topic_ |
Client of the sound play service. | |
double | current_vel |
int | dead_man_button_ |
Number of the DEADMAN button. | |
ros::Publisher | joint_command_pub_ |
It will publish into command velocity (for the robot) and the ptz_state (for the pantilt) | |
double | max_freq_command |
Diagnostics max freq. | |
double | max_freq_joy |
double | min_freq_command |
Diagnostics min freq. | |
double | min_freq_joy |
ros::NodeHandle | nh_ |
int | num_of_buttons_ |
Number of buttons of the joystick. | |
ros::Subscriber | pad_sub_ |
It will be suscribed to the joystick. | |
diagnostic_updater::HeaderlessTopicDiagnostic * | pub_command_freq |
Diagnostic to control the frequency of the published command velocity topic. | |
double | scale_linear_z_ |
double | scale_pan_ |
double | scale_tilt_ |
int | speed_down_button_ |
int | speed_up_button_ |
Number of the button for increase or decrease the speed max of the joystick. | |
diagnostic_updater::HeaderlessTopicDiagnostic * | sus_joy_freq |
Diagnostic to control the reception frequency of the subscribed joy topic. | |
diagnostic_updater::Updater | updater_pad |
General status diagnostic updater. |
Definition at line 56 of file rb1_torso_pad.cpp.
Definition at line 116 of file rb1_torso_pad.cpp.
void RB1TorsoPad::padCallback | ( | const sensor_msgs::Joy::ConstPtr & | joy | ) | [private] |
Definition at line 182 of file rb1_torso_pad.cpp.
void RB1TorsoPad::Update | ( | ) |
Definition at line 178 of file rb1_torso_pad.cpp.
int RB1TorsoPad::axis_linear_z_ [private] |
Definition at line 67 of file rb1_torso_pad.cpp.
int RB1TorsoPad::axis_pan_ [private] |
Definition at line 70 of file rb1_torso_pad.cpp.
int RB1TorsoPad::axis_tilt_ [private] |
Definition at line 73 of file rb1_torso_pad.cpp.
bool RB1TorsoPad::bRegisteredButtonEvent[DEFAULT_NUM_OF_BUTTONS] [private] |
Pointer to a vector for controlling the event when pushing the buttons.
Definition at line 93 of file rb1_torso_pad.cpp.
std::string RB1TorsoPad::cmd_topic_ [private] |
Client of the sound play service.
Definition at line 108 of file rb1_torso_pad.cpp.
double RB1TorsoPad::current_vel [private] |
Definition at line 81 of file rb1_torso_pad.cpp.
int RB1TorsoPad::dead_man_button_ [private] |
Number of the DEADMAN button.
Definition at line 84 of file rb1_torso_pad.cpp.
It will publish into command velocity (for the robot) and the ptz_state (for the pantilt)
Definition at line 77 of file rb1_torso_pad.cpp.
double RB1TorsoPad::max_freq_command [private] |
Diagnostics max freq.
Definition at line 105 of file rb1_torso_pad.cpp.
double RB1TorsoPad::max_freq_joy [private] |
Definition at line 105 of file rb1_torso_pad.cpp.
double RB1TorsoPad::min_freq_command [private] |
Diagnostics min freq.
Definition at line 103 of file rb1_torso_pad.cpp.
double RB1TorsoPad::min_freq_joy [private] |
Definition at line 103 of file rb1_torso_pad.cpp.
ros::NodeHandle RB1TorsoPad::nh_ [private] |
Definition at line 65 of file rb1_torso_pad.cpp.
int RB1TorsoPad::num_of_buttons_ [private] |
Number of buttons of the joystick.
Definition at line 90 of file rb1_torso_pad.cpp.
ros::Subscriber RB1TorsoPad::pad_sub_ [private] |
It will be suscribed to the joystick.
Definition at line 79 of file rb1_torso_pad.cpp.
Diagnostic to control the frequency of the published command velocity topic.
Definition at line 97 of file rb1_torso_pad.cpp.
double RB1TorsoPad::scale_linear_z_ [private] |
Definition at line 68 of file rb1_torso_pad.cpp.
double RB1TorsoPad::scale_pan_ [private] |
Definition at line 71 of file rb1_torso_pad.cpp.
double RB1TorsoPad::scale_tilt_ [private] |
Definition at line 74 of file rb1_torso_pad.cpp.
int RB1TorsoPad::speed_down_button_ [private] |
Definition at line 87 of file rb1_torso_pad.cpp.
int RB1TorsoPad::speed_up_button_ [private] |
Number of the button for increase or decrease the speed max of the joystick.
Definition at line 87 of file rb1_torso_pad.cpp.
Diagnostic to control the reception frequency of the subscribed joy topic.
Definition at line 99 of file rb1_torso_pad.cpp.
General status diagnostic updater.
Definition at line 101 of file rb1_torso_pad.cpp.