$search

common.h File Reference

#include <pcl/point_types.h>
#include <pcl/filters/extract_indices.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/io/pcd_io.h>
#include <pcl/visualization/cloud_viewer.h>
#include <pcl/kdtree/kdtree_flann.h>
#include <pcl/kdtree/kdtree.h>
#include <pcl/features/normal_3d.h>
#include <geometry_msgs/Pose.h>
#include <pcl/registration/registration.h>
Include dependency graph for common.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Typedefs

typedef pcl::PointXYZRGB PointT

Functions

template<class P , class N >
pcl::PointCloud< N >::Ptr compute_surface_normals (typename pcl::PointCloud< P >::ConstPtr points, float normal_radius)
template<class P >
pcl::PointCloud< P >::Ptr downsample (typename pcl::PointCloud< P >::ConstPtr cloud, double voxel_grid_size)
template<class C >
void extractIndices (const typename C::Ptr &input, const pcl::PointIndices &indices, C &output, bool positive=true)
template<class C >
void extractIndices (const typename C::ConstPtr &input, pcl::PointIndices::ConstPtr indices, C &output, bool positive=true)
template<class P >
pcl::PointCloud< P >::Ptr loadPCDFile (const std::string &filename)
template<class P , class N >
void quickViz (boost::shared_ptr< const pcl::PointCloud< P > > cloud, boost::shared_ptr< const pcl::PointCloud< N > > normals, const std::string &title=std::string("Cloud"))
template<class P >
void quickViz (boost::shared_ptr< const pcl::PointCloud< P > > cloud, const std::string &title=std::string("Cloud"))
template<class P >
void transform (typename pcl::PointCloud< P >::Ptr cloud_in, typename pcl::PointCloud< P >::Ptr cloud_out, const geometry_msgs::Pose &p)
template<class P >
void transform_inverse (typename pcl::PointCloud< P >::Ptr cloud_in, typename pcl::PointCloud< P >::Ptr cloud_out, const geometry_msgs::Pose &p)

Typedef Documentation

typedef pcl::PointXYZRGB PointT

Definition at line 16 of file common.h.


Function Documentation

template<class P , class N >
pcl::PointCloud<N>::Ptr compute_surface_normals ( typename pcl::PointCloud< P >::ConstPtr  points,
float  normal_radius 
) [inline]

Definition at line 81 of file common.h.

template<class P >
pcl::PointCloud<P>::Ptr downsample ( typename pcl::PointCloud< P >::ConstPtr  cloud,
double  voxel_grid_size 
) [inline]

Definition at line 68 of file common.h.

template<class C >
void extractIndices ( const typename C::Ptr &  input,
const pcl::PointIndices indices,
C &  output,
bool  positive = true 
) [inline]

Definition at line 51 of file common.h.

template<class C >
void extractIndices ( const typename C::ConstPtr &  input,
pcl::PointIndices::ConstPtr  indices,
C &  output,
bool  positive = true 
) [inline]

Definition at line 41 of file common.h.

template<class P >
pcl::PointCloud<P>::Ptr loadPCDFile ( const std::string &  filename  )  [inline]

Definition at line 59 of file common.h.

template<class P , class N >
void quickViz ( boost::shared_ptr< const pcl::PointCloud< P > >  cloud,
boost::shared_ptr< const pcl::PointCloud< N > >  normals,
const std::string &  title = std::string("Cloud") 
) [inline]

Definition at line 29 of file common.h.

template<class P >
void quickViz ( boost::shared_ptr< const pcl::PointCloud< P > >  cloud,
const std::string &  title = std::string("Cloud") 
) [inline]

Definition at line 19 of file common.h.

template<class P >
void transform ( typename pcl::PointCloud< P >::Ptr  cloud_in,
typename pcl::PointCloud< P >::Ptr  cloud_out,
const geometry_msgs::Pose p 
) [inline]

Definition at line 104 of file common.h.

template<class P >
void transform_inverse ( typename pcl::PointCloud< P >::Ptr  cloud_in,
typename pcl::PointCloud< P >::Ptr  cloud_out,
const geometry_msgs::Pose p 
) [inline]

Definition at line 114 of file common.h.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


simple_object_capture
Author(s): Stuart Glaser
autogenerated on Sat Mar 2 13:37:07 2013