Functions | Variables
stackDepthPoint.cpp File Reference
#include <math.h>
#include <stdio.h>
#include <stdlib.h>
#include <ros/ros.h>
#include "pointDefinition.h"
Include dependency graph for stackDepthPoint.cpp:

Go to the source code of this file.

Functions

void depthPointsHandler (const sensor_msgs::PointCloud2ConstPtr &depthPoints2)
pcl::PointCloud< DepthPoint >::Ptr depthPointsStacked (new pcl::PointCloud< DepthPoint >())
int main (int argc, char **argv)

Variables

pcl::PointCloud< DepthPoint >::Ptr depthPoints [keyframeNum]
ros::PublisherdepthPointsPubPointer = NULL
double depthPointsTime [keyframeNum]
int frameCount = 0
int keyframeCount = 0
const int keyframeNum = 5
double lastPubTime = 0
const double PI = 3.1415926

Function Documentation

void depthPointsHandler ( const sensor_msgs::PointCloud2ConstPtr &  depthPoints2)

Definition at line 21 of file stackDepthPoint.cpp.

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

Definition at line 56 of file stackDepthPoint.cpp.


Variable Documentation

Definition at line 11 of file stackDepthPoint.cpp.

Definition at line 17 of file stackDepthPoint.cpp.

Definition at line 12 of file stackDepthPoint.cpp.

int frameCount = 0

Definition at line 14 of file stackDepthPoint.cpp.

int keyframeCount = 0

Definition at line 13 of file stackDepthPoint.cpp.

const int keyframeNum = 5

Definition at line 10 of file stackDepthPoint.cpp.

double lastPubTime = 0

Definition at line 19 of file stackDepthPoint.cpp.

const double PI = 3.1415926

Definition at line 8 of file stackDepthPoint.cpp.



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