Defines | Functions | Variables
test_pid.cpp File Reference
#include <ros/ros.h>
#include "roch_base/roch_hardware.h"
#include <boost/assign/list_of.hpp>
#include <float.h>
Include dependency graph for test_pid.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
double speed_z
ros::Subscriber speedSubscriber_

Define Documentation

#define polling_timeout_   20

Definition at line 6 of file test_pid.cpp.


Function Documentation

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

Definition at line 31 of file test_pid.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 88 of file test_pid.cpp.

void publishRawData ( )

Definition at line 15 of file test_pid.cpp.

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

Definition at line 54 of file test_pid.cpp.


Variable Documentation

double speed_x

Definition at line 11 of file test_pid.cpp.

double speed_z

Definition at line 14 of file test_pid.cpp.

Definition at line 87 of file test_pid.cpp.



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