Public Member Functions | Private Member Functions | Private Attributes
GuardianJoy Class Reference

List of all members.

Public Member Functions

bool EnableDisable (guardian_joystick::enable_disable::Request &req, guardian_joystick::enable_disable::Response &res)
 GuardianJoy ()

Private Member Functions

void joyCallback (const sensor_msgs::Joy::ConstPtr &joy)

Private Attributes

double a_scale_
int angular_
bool bEnable
 Flag to enable/disable the communication with the publishers topics.
bool bOutput1
bool bOutput2
bool bRegisteredButtonEvent [NUM_BUTTONS]
 Pointer to a vector for controlling the event when pushing the buttons.
int button_kinematic_mode_
 button to change kinematic mode
int button_output_1_
int button_output_2_
std::string cmd_service_io_
 Name of the service where it will be modifying the digital outputs.
std::string cmd_set_mode_
 Name of the service to change the mode.
std::string cmd_topic_ptz_
 Name of the topic where it will be publishing the pant-tilt values.
std::string cmd_topic_vel_
 Name of the topic where it will be publishing the velocity.
double current_vel
int dead_man_button_
 Number of the DEADMAN button.
ros::ServiceServer enable_disable_srv_
 Enables/disables the pad.
ros::Subscriber joy_sub_
 It will be suscribed to the joystick.
int kinematic_mode_
 kinematic mode
double l_scale_x_
double l_scale_y_
double l_scale_z_
int linear_x_
int linear_y_
int linear_z_
ros::ServiceClient modbus_write_do_client
 Service to modify the digital outputs.
ros::NodeHandle nh_
int num_of_buttons_
 Number of buttons of the joystick.
int output_1_
int output_2_
int pan_increment_
 Pan & tilt increment (degrees)
int ptz_pan_left_
int ptz_pan_right_
ros::Publisher ptz_pub_
int ptz_tilt_down_
int ptz_tilt_up_
 buttons to the pan-tilt camera
ros::ServiceClient setKinematicMode
 Service to modify the kinematic mode.
int speed_down_button_
int speed_up_button_
 Number of the button for increase or decrease the speed max of the joystick.
int tilt_increment_
ros::Publisher vel_pub_
 It will publish into command velocity (for the robot) and the ptz_state (for the pantilt)

Detailed Description

Definition at line 53 of file guardian_joystick.cpp.


Constructor & Destructor Documentation

Definition at line 110 of file guardian_joystick.cpp.


Member Function Documentation

bool GuardianJoy::EnableDisable ( guardian_joystick::enable_disable::Request &  req,
guardian_joystick::enable_disable::Response &  res 
)

Definition at line 202 of file guardian_joystick.cpp.

void GuardianJoy::joyCallback ( const sensor_msgs::Joy::ConstPtr &  joy) [private]

Definition at line 211 of file guardian_joystick.cpp.


Member Data Documentation

double GuardianJoy::a_scale_ [private]

Definition at line 65 of file guardian_joystick.cpp.

int GuardianJoy::angular_ [private]

Definition at line 64 of file guardian_joystick.cpp.

bool GuardianJoy::bEnable [private]

Flag to enable/disable the communication with the publishers topics.

Definition at line 106 of file guardian_joystick.cpp.

bool GuardianJoy::bOutput1 [private]

Definition at line 84 of file guardian_joystick.cpp.

bool GuardianJoy::bOutput2 [private]

Definition at line 84 of file guardian_joystick.cpp.

Pointer to a vector for controlling the event when pushing the buttons.

Definition at line 104 of file guardian_joystick.cpp.

button to change kinematic mode

Definition at line 88 of file guardian_joystick.cpp.

Definition at line 82 of file guardian_joystick.cpp.

Definition at line 82 of file guardian_joystick.cpp.

std::string GuardianJoy::cmd_service_io_ [private]

Name of the service where it will be modifying the digital outputs.

Definition at line 74 of file guardian_joystick.cpp.

std::string GuardianJoy::cmd_set_mode_ [private]

Name of the service to change the mode.

Definition at line 94 of file guardian_joystick.cpp.

std::string GuardianJoy::cmd_topic_ptz_ [private]

Name of the topic where it will be publishing the pant-tilt values.

Definition at line 76 of file guardian_joystick.cpp.

std::string GuardianJoy::cmd_topic_vel_ [private]

Name of the topic where it will be publishing the velocity.

Definition at line 72 of file guardian_joystick.cpp.

double GuardianJoy::current_vel [private]

Definition at line 77 of file guardian_joystick.cpp.

Number of the DEADMAN button.

Definition at line 79 of file guardian_joystick.cpp.

Enables/disables the pad.

Definition at line 86 of file guardian_joystick.cpp.

It will be suscribed to the joystick.

Definition at line 70 of file guardian_joystick.cpp.

kinematic mode

Definition at line 90 of file guardian_joystick.cpp.

double GuardianJoy::l_scale_x_ [private]

Definition at line 65 of file guardian_joystick.cpp.

double GuardianJoy::l_scale_y_ [private]

Definition at line 65 of file guardian_joystick.cpp.

double GuardianJoy::l_scale_z_ [private]

Definition at line 65 of file guardian_joystick.cpp.

int GuardianJoy::linear_x_ [private]

Definition at line 64 of file guardian_joystick.cpp.

int GuardianJoy::linear_y_ [private]

Definition at line 64 of file guardian_joystick.cpp.

int GuardianJoy::linear_z_ [private]

Definition at line 64 of file guardian_joystick.cpp.

Service to modify the digital outputs.

Definition at line 100 of file guardian_joystick.cpp.

Definition at line 62 of file guardian_joystick.cpp.

Number of buttons of the joystick.

Definition at line 102 of file guardian_joystick.cpp.

int GuardianJoy::output_1_ [private]

Definition at line 83 of file guardian_joystick.cpp.

int GuardianJoy::output_2_ [private]

Definition at line 83 of file guardian_joystick.cpp.

Pan & tilt increment (degrees)

Definition at line 98 of file guardian_joystick.cpp.

Definition at line 96 of file guardian_joystick.cpp.

Definition at line 96 of file guardian_joystick.cpp.

Definition at line 68 of file guardian_joystick.cpp.

Definition at line 96 of file guardian_joystick.cpp.

buttons to the pan-tilt camera

Definition at line 96 of file guardian_joystick.cpp.

Service to modify the kinematic mode.

Definition at line 92 of file guardian_joystick.cpp.

Definition at line 81 of file guardian_joystick.cpp.

Number of the button for increase or decrease the speed max of the joystick.

Definition at line 81 of file guardian_joystick.cpp.

Definition at line 98 of file guardian_joystick.cpp.

It will publish into command velocity (for the robot) and the ptz_state (for the pantilt)

Definition at line 67 of file guardian_joystick.cpp.


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


guardian_joystick
Author(s): Roberto Guzmán
autogenerated on Fri Aug 28 2015 10:59:30