#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
#include <sensor_msgs/Joy.h>
#include "kurt3d/Scan.h"
#include <sensor_msgs/JointState.h>
Go to the source code of this file.
Defines | |
#define | RAD(GRAD) ((GRAD * (float)M_PI) / (float)180) |
Functions | |
int | main (int argc, char **argv) |
void | ps3joyCallback (const sensor_msgs::Joy::ConstPtr &joy) |
Variables | |
static ros::ServiceClient | client |
static double | max_pos [5] |
double | max_rotational_vel |
double | max_vel_x |
static double | min_pos [5] |
ros::Publisher | servo_pub |
double | speed_multiplier |
ros::Publisher | vel_pub |
#define RAD | ( | GRAD | ) | ((GRAD * (float)M_PI) / (float)180) |
Definition at line 36 of file ps3joy_kurt3d.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 139 of file ps3joy_kurt3d.cpp.
void ps3joyCallback | ( | const sensor_msgs::Joy::ConstPtr & | joy | ) |
Definition at line 61 of file ps3joy_kurt3d.cpp.
ros::ServiceClient client [static] |
Definition at line 41 of file ps3joy_kurt3d.cpp.
double max_pos[5] [static] |
double max_rotational_vel |
Definition at line 38 of file ps3joy_kurt3d.cpp.
double max_vel_x |
Definition at line 38 of file ps3joy_kurt3d.cpp.
double min_pos[5] [static] |
Definition at line 42 of file ps3joy_kurt3d.cpp.
double speed_multiplier |
Definition at line 40 of file ps3joy_kurt3d.cpp.
Definition at line 39 of file ps3joy_kurt3d.cpp.