Functions | Variables
processDepthmap.cpp File Reference
#include <math.h>
#include <stdio.h>
#include <stdlib.h>
#include <ros/ros.h>
#include <nav_msgs/Odometry.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
#include <tf/transform_broadcaster.h>
#include "pointDefinition.h"
Include dependency graph for processDepthmap.cpp:

Go to the source code of this file.

Functions

pcl::PointCloud
< pcl::PointXYZI >::Ptr 
depthCloud (new pcl::PointCloud< pcl::PointXYZI >())
int main (int argc, char **argv)
void syncCloudHandler (const sensor_msgs::PointCloud2ConstPtr &syncCloud2)
pcl::PointCloud
< pcl::PointXYZI >::Ptr 
tempCloud (new pcl::PointCloud< pcl::PointXYZI >())
pcl::PointCloud
< pcl::PointXYZI >::Ptr 
tempCloud2 (new pcl::PointCloud< pcl::PointXYZI >())
void voDataHandler (const nav_msgs::Odometry::ConstPtr &voData)

Variables

int cloudRegInd = 0
ros::PublisherdepthCloudPubPointer = NULL
const int keepSyncCloudNum = 20
const double PI = 3.1415926
double rxRec = 0
double ryRec = 0
double rzRec = 0
pcl::PointCloud< pcl::PointXYZ >
::Ptr 
syncCloudArray [keepSyncCloudNum]
int syncCloudInd = -1
double syncCloudTime [keepSyncCloudNum] = {0}
double timeRec = 0
double txRec = 0
double tyRec = 0
double tzRec = 0

Function Documentation

pcl::PointCloud<pcl::PointXYZI>::Ptr depthCloud ( new pcl::PointCloud< pcl::PointXYZI >  ())
int main ( int  argc,
char **  argv 
)

Definition at line 213 of file processDepthmap.cpp.

void syncCloudHandler ( const sensor_msgs::PointCloud2ConstPtr &  syncCloud2)

Definition at line 202 of file processDepthmap.cpp.

pcl::PointCloud<pcl::PointXYZI>::Ptr tempCloud ( new pcl::PointCloud< pcl::PointXYZI >  ())
pcl::PointCloud<pcl::PointXYZI>::Ptr tempCloud2 ( new pcl::PointCloud< pcl::PointXYZI >  ())
void voDataHandler ( const nav_msgs::Odometry::ConstPtr &  voData)

Definition at line 32 of file processDepthmap.cpp.


Variable Documentation

int cloudRegInd = 0

Definition at line 20 of file processDepthmap.cpp.

Definition at line 30 of file processDepthmap.cpp.

const int keepSyncCloudNum = 20

Definition at line 16 of file processDepthmap.cpp.

const double PI = 3.1415926

Definition at line 14 of file processDepthmap.cpp.

double rxRec = 0

Definition at line 27 of file processDepthmap.cpp.

double ryRec = 0

Definition at line 27 of file processDepthmap.cpp.

double rzRec = 0

Definition at line 27 of file processDepthmap.cpp.

Definition at line 18 of file processDepthmap.cpp.

int syncCloudInd = -1

Definition at line 19 of file processDepthmap.cpp.

Definition at line 17 of file processDepthmap.cpp.

double timeRec = 0

Definition at line 26 of file processDepthmap.cpp.

double txRec = 0

Definition at line 28 of file processDepthmap.cpp.

double tyRec = 0

Definition at line 28 of file processDepthmap.cpp.

double tzRec = 0

Definition at line 28 of file processDepthmap.cpp.



demo_lidar
Author(s): Ji Zhang
autogenerated on Fri Jan 3 2014 11:17:40