Point Cloud Library (PCL)  1.3.1
Namespaces | Functions
pcl::io Namespace Reference

Namespaces

namespace  ply

Functions

template<std::size_t N>
void swapByte (char *bytes)
 swap bytes order of a char array of length N
template<>
void swapByte< 1 > (char *bytes)
 specialization of swapByte for dimension 1
template<>
void swapByte< 2 > (char *bytes)
 specialization of swapByte for dimension 2
template<>
void swapByte< 4 > (char *bytes)
 specialization of swapByte for dimension 4
template<>
void swapByte< 8 > (char *bytes)
 specialization of swapByte for dimension 8
template<typename T >
void swapByte (T &value)
 swaps byte of an arbitrary type T casting it to char*
PCL_EXPORTS int saveOBJFile (const std::string &file_name, const pcl::TextureMesh &tex_mesh, unsigned precision=5)
 Saves a TextureMesh in ascii OBJ format.
int loadPCDFile (const std::string &file_name, sensor_msgs::PointCloud2 &cloud)
 Load a PCD v.6 file into a templated PointCloud type.
int loadPCDFile (const std::string &file_name, sensor_msgs::PointCloud2 &cloud, Eigen::Vector4f &origin, Eigen::Quaternionf &orientation)
 Load any PCD file into a templated PointCloud type.
template<typename PointT >
int loadPCDFile (const std::string &file_name, pcl::PointCloud< PointT > &cloud)
 Load any PCD file into a templated PointCloud type.
int savePCDFile (const std::string &file_name, const sensor_msgs::PointCloud2 &cloud, const Eigen::Vector4f &origin=Eigen::Vector4f::Zero(), const Eigen::Quaternionf &orientation=Eigen::Quaternionf::Identity(), const bool binary_mode=false)
 Save point cloud data to a PCD file containing n-D points.
template<typename PointT >
int savePCDFile (const std::string &file_name, const pcl::PointCloud< PointT > &cloud, bool binary_mode=false)
 Templated version for saving point cloud data to a PCD file containing a specific given cloud format.
template<typename PointT >
int savePCDFileASCII (const std::string &file_name, const pcl::PointCloud< PointT > &cloud)
 Templated version for saving point cloud data to a PCD file containing a specific given cloud format.
template<typename PointT >
int savePCDFileBinary (const std::string &file_name, const pcl::PointCloud< PointT > &cloud)
 Templated version for saving point cloud data to a PCD file containing a specific given cloud format.
template<typename PointT >
int savePCDFile (const std::string &file_name, const pcl::PointCloud< PointT > &cloud, const std::vector< int > &indices, const bool binary_mode=false)
 Templated version for saving point cloud data to a PCD file containing a specific given cloud format.
int loadPLYFile (const std::string &file_name, sensor_msgs::PointCloud2 &cloud)
 Load a PLY v.6 file into a templated PointCloud type.
int loadPLYFile (const std::string &file_name, sensor_msgs::PointCloud2 &cloud, Eigen::Vector4f &origin, Eigen::Quaternionf &orientation)
 Load any PLY file into a templated PointCloud type.
template<typename PointT >
int loadPLYFile (const std::string &file_name, pcl::PointCloud< PointT > &cloud)
 Load any PLY file into a templated PointCloud type.
int savePLYFile (const std::string &file_name, const sensor_msgs::PointCloud2 &cloud, const Eigen::Vector4f &origin=Eigen::Vector4f::Zero(), const Eigen::Quaternionf &orientation=Eigen::Quaternionf::Identity(), bool binary_mode=false)
 Save point cloud data to a PLY file containing n-D points.
template<typename PointT >
int 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 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 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.
template<typename PointT >
int 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 savePLYFile (const std::string &file_name, const pcl::PolygonMesh &mesh, unsigned precision=5)
 Saves a PolygonMesh in ascii PLY format.
PCL_EXPORTS int saveVTKFile (const std::string &file_name, const pcl::PolygonMesh &triangles, unsigned precision=5)
 Saves a PolygonMesh in ascii VTK format.
PCL_EXPORTS int vtk2mesh (const vtkSmartPointer< vtkPolyData > &poly_data, pcl::PolygonMesh &mesh)
 Saves a PolygonMesh in ascii VTK format.
PCL_EXPORTS int mesh2vtk (const pcl::PolygonMesh &mesh, vtkSmartPointer< vtkPolyData > &poly_data)
 Convert a PCL PolygonMesh to a vtkPolyData object.
PCL_EXPORTS int loadPolygonFile (const std::string &file_name, pcl::PolygonMesh &mesh)
PCL_EXPORTS int savePolygonFile (const std::string &file_name, const pcl::PolygonMesh &mesh)
PCL_EXPORTS int loadPolygonFileVTK (const std::string &file_name, pcl::PolygonMesh &mesh)
PCL_EXPORTS int loadPolygonFilePLY (const std::string &file_name, pcl::PolygonMesh &mesh)
PCL_EXPORTS int loadPolygonFileOBJ (const std::string &file_name, pcl::PolygonMesh &mesh)
PCL_EXPORTS int loadPolygonFileSTL (const std::string &file_name, pcl::PolygonMesh &mesh)
PCL_EXPORTS int savePolygonFileVTK (const std::string &file_name, const pcl::PolygonMesh &mesh)
PCL_EXPORTS int savePolygonFilePLY (const std::string &file_name, const pcl::PolygonMesh &mesh)
PCL_EXPORTS int savePolygonFileOBJ (const std::string &file_name, const pcl::PolygonMesh &mesh)
PCL_EXPORTS int savePolygonFileSTL (const std::string &file_name, const pcl::PolygonMesh &mesh)
PCL_EXPORTS int savePolygonFileWRL (const std::string &file_name, const pcl::PolygonMesh &mesh)
int savePolygonFileVRML (const std::string &file_name, const pcl::PolygonMesh &mesh)

Function Documentation

PCL_EXPORTS int pcl::io::loadPolygonFile ( const std::string &  file_name,
pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::loadPolygonFileOBJ ( const std::string &  file_name,
pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::loadPolygonFilePLY ( const std::string &  file_name,
pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::loadPolygonFileSTL ( const std::string &  file_name,
pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::loadPolygonFileVTK ( const std::string &  file_name,
pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::mesh2vtk ( const pcl::PolygonMesh mesh,
vtkSmartPointer< vtkPolyData > &  poly_data 
)

Convert a PCL PolygonMesh to a vtkPolyData object.

Parameters:
meshReference to PCL Polygon Mesh
poly_dataPointer (vtkSmartPointer) to a vtkPolyData object
Returns:
Number of points in the point cloud of mesh.
PCL_EXPORTS int pcl::io::savePolygonFile ( const std::string &  file_name,
const pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::savePolygonFileOBJ ( const std::string &  file_name,
const pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::savePolygonFilePLY ( const std::string &  file_name,
const pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::savePolygonFileSTL ( const std::string &  file_name,
const pcl::PolygonMesh mesh 
)
int pcl::io::savePolygonFileVRML ( const std::string &  file_name,
const pcl::PolygonMesh mesh 
) [inline]

Definition at line 144 of file vtk_lib_io.h.

PCL_EXPORTS int pcl::io::savePolygonFileVTK ( const std::string &  file_name,
const pcl::PolygonMesh mesh 
)
PCL_EXPORTS int pcl::io::savePolygonFileWRL ( const std::string &  file_name,
const pcl::PolygonMesh mesh 
)
template<typename T >
void pcl::io::swapByte ( T &  value)

swaps byte of an arbitrary type T casting it to char*

Parameters:
valuethe data you want its bytes swapped

Definition at line 426 of file io.h.

template<>
void pcl::io::swapByte< 1 > ( char *  bytes) [inline]

specialization of swapByte for dimension 1

Parameters:
byteschar array to swap

Definition at line 391 of file io.h.

template<>
void pcl::io::swapByte< 2 > ( char *  bytes) [inline]

specialization of swapByte for dimension 2

Parameters:
byteschar array to swap

Definition at line 398 of file io.h.

template<>
void pcl::io::swapByte< 4 > ( char *  bytes) [inline]

specialization of swapByte for dimension 4

Parameters:
byteschar array to swap

Definition at line 404 of file io.h.

template<>
void pcl::io::swapByte< 8 > ( char *  bytes) [inline]

specialization of swapByte for dimension 8

Parameters:
byteschar array to swap

Definition at line 414 of file io.h.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Defines