Classes | Defines | Typedefs | Functions
openni_boundary_estimation.cpp File Reference
#include <boost/thread/thread.hpp>
#include <boost/make_shared.hpp>
#include <boost/date_time/posix_time/posix_time.hpp>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/io/openni_grabber.h>
#include <pcl/io/pcd_io.h>
#include <pcl/io/openni_camera/openni_driver.h>
#include <pcl/filters/approximate_voxel_grid.h>
#include <pcl/features/boundary.h>
#include <pcl/features/integral_image_normal.h>
#include <pcl/console/parse.h>
#include <pcl/common/time.h>
#include <pcl/visualization/cloud_viewer.h>
Include dependency graph for openni_boundary_estimation.cpp:

Go to the source code of this file.

Classes

class  OpenNIIntegralImageNormalEstimation< PointType >

Defines

#define FPS_CALC(_WHAT_)

Typedefs

typedef
pcl::visualization::PointCloudColorHandler
< sensor_msgs::PointCloud2 > 
ColorHandler
typedef ColorHandler::ConstPtr ColorHandlerConstPtr
typedef ColorHandler::Ptr ColorHandlerPtr

Functions

int main (int argc, char **argv)
void usage (char **argv)

Define Documentation

#define FPS_CALC (   _WHAT_)
Value:
do \
{ \
    static unsigned count = 0;\
    static double last = pcl::getTime ();\
    double now = pcl::getTime (); \
    ++count; \
    if (now - last >= 1.0) \
    { \
      std::cout << "Average framerate("<< _WHAT_ << "): " << double(count)/double(now - last) << " Hz" <<  std::endl; \
      count = 0; \
      last = now; \
    } \
}while(false)

Definition at line 57 of file openni_boundary_estimation.cpp.


Typedef Documentation

typedef pcl::visualization::PointCloudColorHandler<sensor_msgs::PointCloud2> ColorHandler

Definition at line 53 of file openni_boundary_estimation.cpp.

Definition at line 55 of file openni_boundary_estimation.cpp.

Definition at line 54 of file openni_boundary_estimation.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 209 of file openni_boundary_estimation.cpp.

void usage ( char **  argv)

Definition at line 188 of file openni_boundary_estimation.cpp.



pcl
Author(s): Open Perception
autogenerated on Mon Oct 6 2014 03:19:13