Functions | Variables
joystick_teleop_node.cpp File Reference
#include "ros/ros.h"
#include "geometry_msgs/Twist.h"
#include "sensor_msgs/Joy.h"
Include dependency graph for joystick_teleop_node.cpp:

Go to the source code of this file.

Functions

void joystickCallback (const sensor_msgs::Joy::ConstPtr &msg)
int main (int argc, char **argv)

Variables

bool firstZeroVel = false
float lastAxes [8]
int lastButtons [11]
double MAX_SPEED_MULT = .5
double MAX_TURN_MULT = .25
bool publishAnyway = false

Function Documentation

void joystickCallback ( const sensor_msgs::Joy::ConstPtr &  msg)

Definition at line 50 of file joystick_teleop_node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 114 of file joystick_teleop_node.cpp.


Variable Documentation

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.

double MAX_SPEED_MULT = .5

Definition at line 39 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.



bwi_joystick_teleop
Author(s): Alex Gonzales
autogenerated on Mon Jun 6 2016 04:50:28