#include <pcl/io/boost.h>#include <pcl/io/file_io.h>#include <pcl/io/ply/ply_parser.h>#include <pcl/PolygonMesh.h>#include <sstream>

Go to the source code of this file.
Classes | |
| class | pcl::PLYReader |
| Point Cloud Data (PLY) file format reader. More... | |
| class | pcl::PLYWriter |
| Point Cloud Data (PLY) file format writer. More... | |
Namespaces | |
| namespace | pcl |
| namespace | pcl::io |
Functions | |
| int | pcl::io::loadPLYFile (const std::string &file_name, pcl::PCLPointCloud2 &cloud) |
| Load a PLY v.6 file into a templated PointCloud type. | |
| int | pcl::io::loadPLYFile (const std::string &file_name, pcl::PCLPointCloud2 &cloud, Eigen::Vector4f &origin, Eigen::Quaternionf &orientation) |
| Load any PLY file into a templated PointCloud type. | |
| template<typename PointT > | |
| int | pcl::io::loadPLYFile (const std::string &file_name, pcl::PointCloud< PointT > &cloud) |
| Load any PLY file into a templated PointCloud type. | |
| int | pcl::io::savePLYFile (const std::string &file_name, const pcl::PCLPointCloud2 &cloud, const Eigen::Vector4f &origin=Eigen::Vector4f::Zero(), const Eigen::Quaternionf &orientation=Eigen::Quaternionf::Identity(), bool binary_mode=false, bool use_camera=true) |
| Save point cloud data to a PLY file containing n-D points. | |
| template<typename PointT > | |
| int | pcl::io::savePLYFile (const std::string &file_name, const pcl::PointCloud< PointT > &cloud, bool binary_mode=false) |
| Templated version for saving point cloud data to a PLY file containing a specific given cloud format. | |
| template<typename PointT > | |
| int | pcl::io::savePLYFile (const std::string &file_name, const pcl::PointCloud< PointT > &cloud, const std::vector< int > &indices, bool binary_mode=false) |
| Templated version for saving point cloud data to a PLY file containing a specific given cloud format. | |
| PCL_EXPORTS int | pcl::io::savePLYFile (const std::string &file_name, const pcl::PolygonMesh &mesh, unsigned precision=5) |
| Saves a PolygonMesh in ascii PLY format. | |
| template<typename PointT > | |
| int | pcl::io::savePLYFileASCII (const std::string &file_name, const pcl::PointCloud< PointT > &cloud) |
| Templated version for saving point cloud data to a PLY file containing a specific given cloud format. | |
| template<typename PointT > | |
| int | pcl::io::savePLYFileBinary (const std::string &file_name, const pcl::PointCloud< PointT > &cloud) |
| Templated version for saving point cloud data to a PLY file containing a specific given cloud format. | |
| PCL_EXPORTS int | pcl::io::savePLYFileBinary (const std::string &file_name, const pcl::PolygonMesh &mesh) |
| Saves a PolygonMesh in binary PLY format. | |