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)
pcl::PointCloud< pcl::PointXYZ >
::Ptr 
syncCloud (new pcl::PointCloud< pcl::PointXYZ >())
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

ros::PublisherdepthCloudPubPointer = NULL
double initTime
const int keepVoDataNum = 30
const double PI = 3.1415926
double rxRec = 0
double ryRec = 0
double rzRec = 0
int startCount = -1
const int startSkipNum = 5
bool systemInited = false
double timeRec = 0
double txRec = 0
double tyRec = 0
double tzRec = 0
int voDataInd = -1
double voDataTime [keepVoDataNum] = {0}
int voRegInd = 0
double voRx [keepVoDataNum] = {0}
double voRy [keepVoDataNum] = {0}
double voRz [keepVoDataNum] = {0}
double voTx [keepVoDataNum] = {0}
double voTy [keepVoDataNum] = {0}
double voTz [keepVoDataNum] = {0}

Function Documentation

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

Definition at line 290 of file processDepthmap.cpp.

pcl::PointCloud<pcl::PointXYZ>::Ptr syncCloud ( new pcl::PointCloud< pcl::PointXYZ >  ())
void syncCloudHandler ( const sensor_msgs::PointCloud2ConstPtr &  syncCloud2)

Definition at line 174 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 44 of file processDepthmap.cpp.


Variable Documentation

Definition at line 42 of file processDepthmap.cpp.

double initTime

Definition at line 37 of file processDepthmap.cpp.

const int keepVoDataNum = 30

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 33 of file processDepthmap.cpp.

double ryRec = 0

Definition at line 33 of file processDepthmap.cpp.

double rzRec = 0

Definition at line 33 of file processDepthmap.cpp.

int startCount = -1

Definition at line 39 of file processDepthmap.cpp.

const int startSkipNum = 5

Definition at line 40 of file processDepthmap.cpp.

bool systemInited = false

Definition at line 36 of file processDepthmap.cpp.

double timeRec = 0

Definition at line 32 of file processDepthmap.cpp.

double txRec = 0

Definition at line 34 of file processDepthmap.cpp.

double tyRec = 0

Definition at line 34 of file processDepthmap.cpp.

double tzRec = 0

Definition at line 34 of file processDepthmap.cpp.

int voDataInd = -1

Definition at line 24 of file processDepthmap.cpp.

double voDataTime[keepVoDataNum] = {0}

Definition at line 17 of file processDepthmap.cpp.

int voRegInd = 0

Definition at line 25 of file processDepthmap.cpp.

double voRx[keepVoDataNum] = {0}

Definition at line 18 of file processDepthmap.cpp.

double voRy[keepVoDataNum] = {0}

Definition at line 19 of file processDepthmap.cpp.

double voRz[keepVoDataNum] = {0}

Definition at line 20 of file processDepthmap.cpp.

double voTx[keepVoDataNum] = {0}

Definition at line 21 of file processDepthmap.cpp.

double voTy[keepVoDataNum] = {0}

Definition at line 22 of file processDepthmap.cpp.

double voTz[keepVoDataNum] = {0}

Definition at line 23 of file processDepthmap.cpp.



demo_lidar
Author(s): Ji Zhang
autogenerated on Sun Mar 1 2015 11:30:50