Defines | Functions | Variables
ps3joy_kurt3d.cpp File Reference
#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
#include <sensor_msgs/Joy.h>
#include "kurt3d/Scan.h"
#include <sensor_msgs/JointState.h>
Include dependency graph for ps3joy_kurt3d.cpp:

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 Documentation

#define RAD (   GRAD)    ((GRAD * (float)M_PI) / (float)180)

Definition at line 36 of file ps3joy_kurt3d.cpp.


Function Documentation

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.


Variable Documentation

Definition at line 41 of file ps3joy_kurt3d.cpp.

double max_pos[5] [static]
Initial value:
{
    RAD(60.0),
    RAD(45.0),
    RAD(45.0),
    RAD(60.0),

}

Definition at line 52 of file ps3joy_kurt3d.cpp.

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]
Initial value:
{
    RAD(-50.0),
    RAD(-65.0),
    RAD(-65.0),
    RAD(-50.0),
    RAD(-65.0) 
}

Definition at line 44 of file ps3joy_kurt3d.cpp.

Definition at line 42 of file ps3joy_kurt3d.cpp.

Definition at line 40 of file ps3joy_kurt3d.cpp.

Definition at line 39 of file ps3joy_kurt3d.cpp.



kurt3d
Author(s): Thomas Wiemann, Benjamin Kisliuk, Alexander Mock
autogenerated on Wed Sep 16 2015 10:24:29