#include <ros/ros.h>
#include <sensor_msgs/Joy.h>
#include <geometry_msgs/Twist.h>
#include "bipedRobin_msgs/SetModeService.h"
#include "std_srvs/Empty.h"
Go to the source code of this file.
Functions | |
void | joyCallback (const sensor_msgs::Joy::ConstPtr &joy_msg) |
int | main (int argc, char **argv) |
Variables | |
const double | max_rotation = 0.2 |
const double | max_speed_x = 0.1 |
const double | max_speed_y = 0.05 |
double | vel_rot |
double | vel_x |
double | vel_y |
void joyCallback | ( | const sensor_msgs::Joy::ConstPtr & | joy_msg | ) |
Definition at line 18 of file joystick_teleop.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 43 of file joystick_teleop.cpp.
const double max_rotation = 0.2 |
Definition at line 15 of file joystick_teleop.cpp.
const double max_speed_x = 0.1 |
Definition at line 13 of file joystick_teleop.cpp.
const double max_speed_y = 0.05 |
Definition at line 14 of file joystick_teleop.cpp.
double vel_rot |
Definition at line 16 of file joystick_teleop.cpp.
double vel_x |
Definition at line 16 of file joystick_teleop.cpp.
double vel_y |
Definition at line 16 of file joystick_teleop.cpp.