Go to the source code of this file.
Functions | |
void | joystickCallback (const sensor_msgs::Joy::ConstPtr &msg) |
int | main (int argc, char **argv) |
Variables | |
int | BRAKE_BUTTON = 1 |
bool | firstZeroVel = false |
float | lastAxes [8] |
int | lastButtons [11] |
int | MAX_SPEED_AXIS = 7 |
double | MAX_SPEED_MULT = .5 |
int | MAX_TURN_AXIS = 6 |
double | MAX_TURN_MULT = .25 |
bool | publishAnyway = false |
int | SPEED_AXIS = 1 |
int | TURN_AXIS = 3 |
void joystickCallback | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) |
Definition at line 57 of file joystick_teleop_node.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 121 of file joystick_teleop_node.cpp.
int BRAKE_BUTTON = 1 |
Definition at line 54 of file joystick_teleop_node.cpp.
bool firstZeroVel = false |
Definition at line 42 of file joystick_teleop_node.cpp.
float lastAxes[8] |
Definition at line 47 of file joystick_teleop_node.cpp.
int lastButtons[11] |
Definition at line 46 of file joystick_teleop_node.cpp.
int MAX_SPEED_AXIS = 7 |
Definition at line 53 of file joystick_teleop_node.cpp.
double MAX_SPEED_MULT = .5 |
Definition at line 39 of file joystick_teleop_node.cpp.
int MAX_TURN_AXIS = 6 |
Definition at line 52 of file joystick_teleop_node.cpp.
double MAX_TURN_MULT = .25 |
Definition at line 40 of file joystick_teleop_node.cpp.
bool publishAnyway = false |
Definition at line 43 of file joystick_teleop_node.cpp.
int SPEED_AXIS = 1 |
Definition at line 50 of file joystick_teleop_node.cpp.
int TURN_AXIS = 3 |
Definition at line 51 of file joystick_teleop_node.cpp.