Defines | Functions | Variables
test_speed.cpp File Reference
#include <ros/ros.h>
#include "roch_base/roch_hardware.h"
#include <geometry_msgs/Twist.h>
#include <boost/assign/list_of.hpp>
#include <float.h>
Include dependency graph for test_speed.cpp:

Go to the source code of this file.

Defines

#define polling_timeout_   20

Functions

void controloverallSpeed (double lin_vel, double ang_vel, double accel_left, double accel_right)
int main (int argc, char **argv)
void publishRawData ()
void speedCallBack (const geometry_msgs::Twist::ConstPtr &speed)

Variables

double speed_x = 0
double speed_z = 0
ros::Subscriber speedSubscriber_

Define Documentation

#define polling_timeout_   20

Definition at line 7 of file test_speed.cpp.


Function Documentation

void controloverallSpeed ( double  lin_vel,
double  ang_vel,
double  accel_left,
double  accel_right 
)

Definition at line 29 of file test_speed.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 72 of file test_speed.cpp.

void publishRawData ( )

Definition at line 15 of file test_speed.cpp.

void speedCallBack ( const geometry_msgs::Twist::ConstPtr &  speed)

Definition at line 49 of file test_speed.cpp.


Variable Documentation

double speed_x = 0

Definition at line 9 of file test_speed.cpp.

double speed_z = 0

Definition at line 10 of file test_speed.cpp.

Definition at line 71 of file test_speed.cpp.



roch_base
Author(s): Mike Purvis , Paul Bovbel , Carl
autogenerated on Sat Jun 8 2019 20:32:33