#include <pcl/common/time.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl/PCLPointCloud2.h>#include <pcl/io/pcd_io.h>#include <pcl/pcl_macros.h>#include <pcl/console/print.h>#include <pcl/console/parse.h>#include <pcl/outofcore/outofcore.h>#include <pcl/outofcore/outofcore_impl.h>#include <boost/foreach.hpp>
Go to the source code of this file.
Typedefs | |
| typedef OutofcoreOctreeBase | octree_disk |
| typedef pcl::PointXYZ | PointT |
Functions | |
| PCLPointCloud2::Ptr | getCloudFromFile (boost::filesystem::path pcd_path) |
| int | main (int argc, char *argv[]) |
| const int | OCTREE_DEPTH (0) |
| const int | OCTREE_RESOLUTION (1) |
| int | outofcoreProcess (std::vector< boost::filesystem::path > pcd_paths, boost::filesystem::path root_dir, int depth, double resolution, int build_octree_with, bool gen_lod, bool overwrite, bool multiresolution) |
| void | printHelp (int, char **argv) |
| typedef OutofcoreOctreeBase octree_disk |
Definition at line 71 of file outofcore_process.cpp.
| typedef pcl::PointXYZ PointT |
Definition at line 57 of file outofcore_process.cpp.
| PCLPointCloud2::Ptr getCloudFromFile | ( | boost::filesystem::path | pcd_path | ) |
Definition at line 77 of file outofcore_process.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 247 of file outofcore_process.cpp.
| const int OCTREE_DEPTH | ( | 0 | ) |
| const int OCTREE_RESOLUTION | ( | 1 | ) |
| int outofcoreProcess | ( | std::vector< boost::filesystem::path > | pcd_paths, |
| boost::filesystem::path | root_dir, | ||
| int | depth, | ||
| double | resolution, | ||
| int | build_octree_with, | ||
| bool | gen_lod, | ||
| bool | overwrite, | ||
| bool | multiresolution | ||
| ) |
Definition at line 97 of file outofcore_process.cpp.
| void printHelp | ( | int | , |
| char ** | argv | ||
| ) |
Definition at line 230 of file outofcore_process.cpp.