Public Member Functions | |
AgvsPad () | |
void | ControlLoop () |
Controls the actions and states. More... | |
int | SetStateMode (int state, int arm_mode, int platform_mode) |
Private Member Functions | |
bool | EnableDisable (robotnik_msgs::enable_disable::Request &req, robotnik_msgs::enable_disable::Response &res) |
Enables/Disables the joystick. More... | |
void | joyCallback (const sensor_msgs::Joy::ConstPtr &joy) |
void | PublishState () |
char * | StateToString (int state) |
int | SwitchToState (int new_state) |
void | Update () |
Private Attributes | |
double | a_scale_ |
int | axis_angular_position_ |
int | axis_linear_speed_ |
bool | bEnable |
Flag to enable/disable the communication with the publishers topics. More... | |
bool | bOutput1 |
bool | bOutput2 |
int | button_dead_man_ |
Number of the DEADMAN button. More... | |
int | button_down_car_ |
int | button_speed_down_ |
int | button_speed_up_ |
Number of the button for increase or decrease the speed max of the joystick. More... | |
int | button_up_car_ |
std::string | cmd_service_io_ |
Name of the service where it will be modifying the digital outputs. More... | |
std::string | cmd_topic_vel |
Name of the topic where it will be publishing the velocity. More... | |
double | current_speed_lvl |
double | desired_freq_ |
Desired component's freq. More... | |
ros::ServiceServer | enable_disable_srv_ |
Service clients. More... | |
std::vector< float > | fAxes |
Vector to save the axis values. More... | |
ros::Subscriber | joy_sub_ |
they will be suscribed to the joysticks More... | |
std::string | joy_topic_ |
// Name of the joystick's topic More... | |
double | l_scale_ |
ros::ServiceClient | lower_elevator_client_ |
double | max_angular_position_ |
double | max_freq_command |
Diagnostics max freq. More... | |
double | max_freq_joy |
double | max_linear_speed_ |
Set the max speed sent to the robot. More... | |
double | min_freq_command |
Diagnostics min freq. More... | |
double | min_freq_joy |
ros::NodeHandle | nh_ |
int | num_of_axes_ |
int | num_of_buttons_ |
Current number of buttons of the joystick. More... | |
int | output_1_ |
int | output_2_ |
diagnostic_updater::HeaderlessTopicDiagnostic * | pub_command_freq |
Diagnostic to control the frequency of the published command velocity topic. More... | |
ros::ServiceClient | raise_elevator_client_ |
std::string | service_lower_elevator_ |
Name of the service called to lower the elevator. More... | |
std::string | service_raise_elevator_ |
Name of the service called to raise the elevator. More... | |
ros::ServiceClient | set_digital_outputs_client_ |
ros::Publisher | state_pub_ |
Topic to publish the state. More... | |
diagnostic_updater::HeaderlessTopicDiagnostic * | sus_joy_freq |
Diagnostic to control the reception frequency of the subscribed joy topic. More... | |
std::string | topic_state_ |
topic name for the state More... | |
diagnostic_updater::Updater | updater_pad |
General status diagnostic updater. More... | |
std::vector< Button > | vButtons |
Vector to save and control the axis values. More... | |
ros::Publisher | vel_pub_ |
It will publish into command velocity (for the robot) More... | |
Definition at line 111 of file agvs_pad_node.cpp.
AgvsPad::AgvsPad | ( | ) |
Definition at line 207 of file agvs_pad_node.cpp.
void AgvsPad::ControlLoop | ( | ) |
Controls the actions and states.
Definition at line 363 of file agvs_pad_node.cpp.
|
private |
Enables/Disables the joystick.
Definition at line 337 of file agvs_pad_node.cpp.
|
private |
Definition at line 347 of file agvs_pad_node.cpp.
|
private |
Definition at line 319 of file agvs_pad_node.cpp.
int AgvsPad::SetStateMode | ( | int | state, |
int | arm_mode, | ||
int | platform_mode | ||
) |
|
private |
|
private |
|
private |
Definition at line 314 of file agvs_pad_node.cpp.
|
private |
Definition at line 137 of file agvs_pad_node.cpp.
|
private |
Definition at line 136 of file agvs_pad_node.cpp.
|
private |
Definition at line 136 of file agvs_pad_node.cpp.
|
private |
Flag to enable/disable the communication with the publishers topics.
Definition at line 203 of file agvs_pad_node.cpp.
|
private |
Definition at line 189 of file agvs_pad_node.cpp.
|
private |
Definition at line 189 of file agvs_pad_node.cpp.
|
private |
Number of the DEADMAN button.
Definition at line 184 of file agvs_pad_node.cpp.
|
private |
Definition at line 187 of file agvs_pad_node.cpp.
|
private |
Definition at line 186 of file agvs_pad_node.cpp.
|
private |
Number of the button for increase or decrease the speed max of the joystick.
Definition at line 186 of file agvs_pad_node.cpp.
|
private |
Definition at line 187 of file agvs_pad_node.cpp.
|
private |
Name of the service where it will be modifying the digital outputs.
Definition at line 155 of file agvs_pad_node.cpp.
|
private |
Name of the topic where it will be publishing the velocity.
Definition at line 153 of file agvs_pad_node.cpp.
|
private |
Definition at line 138 of file agvs_pad_node.cpp.
|
private |
Desired component's freq.
Definition at line 142 of file agvs_pad_node.cpp.
|
private |
Service clients.
Definition at line 168 of file agvs_pad_node.cpp.
|
private |
Vector to save the axis values.
Definition at line 180 of file agvs_pad_node.cpp.
|
private |
they will be suscribed to the joysticks
Definition at line 149 of file agvs_pad_node.cpp.
|
private |
// Name of the joystick's topic
Definition at line 151 of file agvs_pad_node.cpp.
|
private |
Definition at line 137 of file agvs_pad_node.cpp.
|
private |
Definition at line 171 of file agvs_pad_node.cpp.
|
private |
Definition at line 140 of file agvs_pad_node.cpp.
|
private |
Diagnostics max freq.
Definition at line 201 of file agvs_pad_node.cpp.
|
private |
Definition at line 201 of file agvs_pad_node.cpp.
|
private |
Set the max speed sent to the robot.
Definition at line 140 of file agvs_pad_node.cpp.
|
private |
Diagnostics min freq.
Definition at line 199 of file agvs_pad_node.cpp.
|
private |
Definition at line 199 of file agvs_pad_node.cpp.
|
private |
Definition at line 134 of file agvs_pad_node.cpp.
|
private |
Definition at line 177 of file agvs_pad_node.cpp.
|
private |
Current number of buttons of the joystick.
Definition at line 176 of file agvs_pad_node.cpp.
|
private |
Definition at line 188 of file agvs_pad_node.cpp.
|
private |
Definition at line 188 of file agvs_pad_node.cpp.
|
private |
Diagnostic to control the frequency of the published command velocity topic.
Definition at line 193 of file agvs_pad_node.cpp.
|
private |
Definition at line 170 of file agvs_pad_node.cpp.
|
private |
Name of the service called to lower the elevator.
Definition at line 164 of file agvs_pad_node.cpp.
|
private |
Name of the service called to raise the elevator.
Definition at line 162 of file agvs_pad_node.cpp.
|
private |
Definition at line 169 of file agvs_pad_node.cpp.
|
private |
Topic to publish the state.
Definition at line 159 of file agvs_pad_node.cpp.
|
private |
Diagnostic to control the reception frequency of the subscribed joy topic.
Definition at line 195 of file agvs_pad_node.cpp.
|
private |
topic name for the state
Definition at line 157 of file agvs_pad_node.cpp.
|
private |
General status diagnostic updater.
Definition at line 197 of file agvs_pad_node.cpp.
|
private |
Vector to save and control the axis values.
Definition at line 182 of file agvs_pad_node.cpp.
|
private |
It will publish into command velocity (for the robot)
Definition at line 146 of file agvs_pad_node.cpp.