#include "pcl/common/common.h"
#include "pcl/filters/voxel_grid.h"
#include "pcl/filters/filter.h"
#include <map>
#include <boost/mpl/size.hpp>
#include <boost/fusion/sequence/intrinsic/at_key.hpp>
Go to the source code of this file.
Defines | |
#define | PCL_INSTANTIATE_getMinMax3D(T) template void pcl::getMinMax3D<T> (const pcl::PointCloud<T>::ConstPtr &, const std::string &, float, float, Eigen::Vector4f &, Eigen::Vector4f &, bool); |
#define | PCL_INSTANTIATE_VoxelGrid(T) template class pcl::VoxelGrid<T>; |
#define PCL_INSTANTIATE_getMinMax3D | ( | T | ) | template void pcl::getMinMax3D<T> (const pcl::PointCloud<T>::ConstPtr &, const std::string &, float, float, Eigen::Vector4f &, Eigen::Vector4f &, bool); |
Definition at line 340 of file voxel_grid.hpp.
#define PCL_INSTANTIATE_VoxelGrid | ( | T | ) | template class pcl::VoxelGrid<T>; |
Definition at line 339 of file voxel_grid.hpp.