Defines | Typedefs | Functions | Variables
ClearpathDemoTrack.cpp File Reference
#include <algorithm>
#include <iostream>
#include <ros/ros.h>
#include <pcl_ros/point_cloud.h>
#include <pcl/point_types.h>
#include "pcl/io/pcd_io.h"
#include "geometry_msgs/Twist.h"
#include "ClearpathDemoTools.h"
Include dependency graph for ClearpathDemoTrack.cpp:

Go to the source code of this file.

Defines

#define MAX_RUNTIME_SECONDS   0.1f

Typedefs

typedef pcl::PointCloud
< PointType
PCLPointCloud
typedef pcl::PointXYZRGB PointType

Functions

void callback (const PCLPointCloud::ConstPtr &cloud)
PCLPointCloud::Ptr final (new PCLPointCloud)
int main (int argc, char **argv)

Variables

double ang_speed = 0.2
double angular_vel_correction = 1.0
double cam_height = 0.55
double cam_z_trans = 0.0
ClearpathDemoTools demo
double lin_speed = 0.2
ros::Publisher pub
int publish_visualization = 1
ros::Publisher pubvel
double window_size = 0.5

Define Documentation

#define MAX_RUNTIME_SECONDS   0.1f

Definition at line 12 of file ClearpathDemoTrack.cpp.


Typedef Documentation

Definition at line 16 of file ClearpathDemoTrack.cpp.

typedef pcl::PointXYZRGB PointType

Definition at line 15 of file ClearpathDemoTrack.cpp.


Function Documentation

void callback ( const PCLPointCloud::ConstPtr &  cloud)

Definition at line 38 of file ClearpathDemoTrack.cpp.

PCLPointCloud::Ptr final ( new  PCLPointCloud)
int main ( int  argc,
char **  argv 
)

Definition at line 85 of file ClearpathDemoTrack.cpp.


Variable Documentation

double ang_speed = 0.2

Definition at line 25 of file ClearpathDemoTrack.cpp.

double angular_vel_correction = 1.0

Definition at line 23 of file ClearpathDemoTrack.cpp.

double cam_height = 0.55

Definition at line 26 of file ClearpathDemoTrack.cpp.

double cam_z_trans = 0.0

Definition at line 27 of file ClearpathDemoTrack.cpp.

Definition at line 32 of file ClearpathDemoTrack.cpp.

double lin_speed = 0.2

Definition at line 24 of file ClearpathDemoTrack.cpp.

Definition at line 19 of file ClearpathDemoTrack.cpp.

Definition at line 29 of file ClearpathDemoTrack.cpp.

Definition at line 20 of file ClearpathDemoTrack.cpp.

double window_size = 0.5

Definition at line 28 of file ClearpathDemoTrack.cpp.



clearpath_kinect_demo
Author(s): Sean Anderson
autogenerated on Thu Jan 2 2014 11:06:26