narf_feature_extraction.cpp File Reference

#include <iostream>
#include "pcl/range_image/range_image.h"
#include "pcl/io/pcd_io.h"
#include "pcl_visualization/range_image_visualizer.h"
#include "pcl_visualization/pcl_visualizer.h"
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <stdio.h>
#include <stdarg.h>
#include "vtkConfigure.h"
#include "vtkWin32Header.h"
#include <fstream>
#include <iomanip>
#include <strstream>
#include <stdlib.h>
#include <string.h>
#include "vtkSystemIncludes.h"
#include <math.h>
#include "vtkObject.h"
#include <sys/types.h>
#include <stddef.h>
#include <X11/Xlib.h>
#include <X11/Xfuncproto.h>
#include <X11/Xosdefs.h>
#include "vtkObjectBase.h"
#include "vtkCollection.h"
#include "vtkProp.h"
#include "vtkPropCollection.h"
#include "vtkProp3D.h"
#include "vtkAlgorithm.h"
#include <vtkRenderWindowInteractor.h>
#include <vtkObjectFactory.h>
#include "vtkCoordinate.h"
#include "vtkInteractorObserver.h"
#include "vtkDataSet.h"
#include "vtkType.h"
#include "vtkSetGet.h"
#include <string>
#include "vtkDataArray.h"
#include "vtkDataArrayTemplate.h"
#include <terminal_tools/print.h>
#include <vtkCommand.h>
#include "vtkActor2D.h"
#include <pcl/io/io.h>
#include <vtkSmartPointer.h>
#include <vtkUnsignedCharArray.h>
#include <vtkPoints.h>
#include <sys/time.h>
#include <pcl/win32_macros.h>
#include <vector>
#include <map>
#include "vtkActor.h"
#include <sensor_msgs/PointCloud2.h>
#include <vtkRenderer.h>
#include <vtkRenderWindow.h>
#include <vtkXRenderWindowInteractor.h>
#include <vtkInteractorStyleTrackballCamera.h>
#include "pcl_visualization/interactor.h"
#include <boost/shared_ptr.hpp>
#include <pcl_visualization/common/common.h>
#include <pcl/ModelCoefficients.h>
#include <vtkPolyData.h>
#include "vtkCellType.h"
#include "vtkPointSet.h"
#include "vtkPolyDataAlgorithm.h"
#include "vtkCell.h"
#include <boost/make_shared.hpp>
#include <boost/config.hpp>
#include <boost/detail/workaround.hpp>
#include <boost/algorithm/string/config.hpp>
#include <algorithm>
#include <iterator>
#include <boost/function.hpp>
#include <boost/iterator.hpp>
#include <boost/iterator/detail/enable_if.hpp>
#include <boost/iterator/iterator_adaptor.hpp>
#include <boost/iterator/iterator_categories.hpp>
#include <boost/mpl/not.hpp>
#include <boost/mpl/bool.hpp>
#include <boost/type_traits/function_traits.hpp>
#include <boost/type_traits/is_const.hpp>
#include <boost/type_traits/is_class.hpp>
#include <boost/type_traits/is_function.hpp>
#include <boost/type_traits/is_reference.hpp>
#include <boost/type_traits/remove_const.hpp>
#include <boost/type_traits/remove_reference.hpp>
#include <boost/iterator/detail/config_def.hpp>
#include <boost/iterator/detail/config_undef.hpp>
#include <boost/assert.hpp>
#include <boost/iterator/iterator_traits.hpp>
#include <boost/type_traits/is_abstract.hpp>
#include <boost/range/begin.hpp>
#include <boost/range/end.hpp>
#include <boost/range/config.hpp>
#include <boost/range/iterator.hpp>
#include <boost/range/difference_type.hpp>
#include <boost/range/rbegin.hpp>
#include <boost/range/rend.hpp>
#include <boost/utility/enable_if.hpp>
#include <ostream>
#include <cstddef>
#include <boost/range/iterator_range.hpp>
#include <utility>
#include <cstring>
#include <cwchar>
#include <boost/preprocessor/cat.hpp>
#include <boost/mpl/if.hpp>
#include <boost/type_traits/conversion_traits.hpp>
#include <boost/type_traits/is_same.hpp>
#include <boost/type_traits/is_void.hpp>
#include <boost/mpl/assert.hpp>
#include <boost/detail/iterator.hpp>
#include <boost/concept/assert.hpp>
#include <boost/preprocessor/arithmetic/dec.hpp>
#include <boost/preprocessor/arithmetic/inc.hpp>
#include <boost/preprocessor/config/config.hpp>
#include <boost/preprocessor/repetition/for.hpp>
#include <boost/preprocessor/seq/seq.hpp>
#include <boost/preprocessor/seq/size.hpp>
#include <boost/preprocessor/tuple/elem.hpp>
#include <boost/preprocessor/tuple/rem.hpp>
#include <boost/preprocessor/seq/enum.hpp>
#include <boost/preprocessor/comma_if.hpp>
#include <boost/iterator/iterator_facade.hpp>
#include <boost/range/as_literal.hpp>
#include <functional>
#include <boost/range/const_iterator.hpp>
#include <boost/algorithm/string/constants.hpp>
#include <boost/range/empty.hpp>
#include <locale>
#include <boost/algorithm/string/compare.hpp>
#include <boost/range/value_type.hpp>
#include <boost/algorithm/string/predicate_facade.hpp>
#include <vtkFloatArray.h>
#include "vtkAbstractArray.h"
#include <vtkTubeFilter.h>
#include "vtkScalarsToColors.h"
#include "vtkMapper.h"
#include <pcl/features/feature.h>
#include <pcl/pcl_macros.h>
#include "pcl/pcl_base.h"
#include <boost/bind.hpp>
#include "pcl/kdtree/kdtree.h"
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Typedefs

typedef PointXYZ PointType

Functions

int main (int argc, char **argv)
void printUsage (const char *progName)

Variables

float angular_resolution = 0.5f
RangeImage::CoordinateFrame coordinate_frame = RangeImage::CAMERA_FRAME
bool rotation_invariant = true
bool setUnseenToMaxRange = false
float support_size = 0.2f

Typedef Documentation

typedef PointXYZ PointType

Definition at line 54 of file narf_feature_extraction.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 84 of file narf_feature_extraction.cpp.

void printUsage ( const char *  progName  ) 

Definition at line 67 of file narf_feature_extraction.cpp.


Variable Documentation

float angular_resolution = 0.5f

Definition at line 59 of file narf_feature_extraction.cpp.

RangeImage::CoordinateFrame coordinate_frame = RangeImage::CAMERA_FRAME

Definition at line 61 of file narf_feature_extraction.cpp.

bool rotation_invariant = true

Definition at line 62 of file narf_feature_extraction.cpp.

bool setUnseenToMaxRange = false

Definition at line 62 of file narf_feature_extraction.cpp.

float support_size = 0.2f

Definition at line 60 of file narf_feature_extraction.cpp.

 All Classes Files Functions Variables Typedefs


pcl_tutorials
Author(s): Radu Bogdan Rusu, Bastian Steder
autogenerated on Fri Jan 11 09:13:00 2013