This is the complete list of members for pcl::TextureMapping< PointInT >, including all inherited members.
Camera typedef | pcl::TextureMapping< PointInT > | |
checkPointInsideTriangle(const pcl::PointXY &p1, const pcl::PointXY &p2, const pcl::PointXY &p3, const pcl::PointXY &pt) | pcl::TextureMapping< PointInT > | inlineprotected |
ConstPtr typedef | pcl::TextureMapping< PointInT > | |
f_ | pcl::TextureMapping< PointInT > | protected |
getClassName() const | pcl::TextureMapping< PointInT > | inlineprotected |
getPointUVCoordinates(const PointInT &pt, const Camera &cam, Eigen::Vector2f &UV_coordinates) | pcl::TextureMapping< PointInT > | inline |
getPointUVCoordinates(const PointInT &pt, const Camera &cam, pcl::PointXY &UV_coordinates) | pcl::TextureMapping< PointInT > | inlineprotected |
getTriangleCircumcenterAndSize(const pcl::PointXY &p1, const pcl::PointXY &p2, const pcl::PointXY &p3, pcl::PointXY &circumcenter, double &radius) | pcl::TextureMapping< PointInT > | inlineprotected |
getTriangleCircumcscribedCircleCentroid(const pcl::PointXY &p1, const pcl::PointXY &p2, const pcl::PointXY &p3, pcl::PointXY &circumcenter, double &radius) | pcl::TextureMapping< PointInT > | inlineprotected |
isFaceProjected(const Camera &camera, const PointInT &p1, const PointInT &p2, const PointInT &p3, pcl::PointXY &proj1, pcl::PointXY &proj2, pcl::PointXY &proj3) | pcl::TextureMapping< PointInT > | inlineprotected |
isPointOccluded(const PointInT &pt, const OctreePtr octree) | pcl::TextureMapping< PointInT > | inline |
mapMultipleTexturesToMeshUV(pcl::TextureMesh &tex_mesh, pcl::texture_mapping::CameraVector &cams) | pcl::TextureMapping< PointInT > | |
mapTexture2Face(const Eigen::Vector3f &p1, const Eigen::Vector3f &p2, const Eigen::Vector3f &p3) | pcl::TextureMapping< PointInT > | protected |
mapTexture2Mesh(pcl::TextureMesh &tex_mesh) | pcl::TextureMapping< PointInT > | |
mapTexture2MeshUV(pcl::TextureMesh &tex_mesh) | pcl::TextureMapping< PointInT > | |
max_angle_ | pcl::TextureMapping< PointInT > | protected |
max_depth_error_ | pcl::TextureMapping< PointInT > | protected |
max_distance_ | pcl::TextureMapping< PointInT > | protected |
min_cluster_size_ | pcl::TextureMapping< PointInT > | protected |
Octree typedef | pcl::TextureMapping< PointInT > | |
OctreeConstPtr typedef | pcl::TextureMapping< PointInT > | |
OctreePtr typedef | pcl::TextureMapping< PointInT > | |
PointCloud typedef | pcl::TextureMapping< PointInT > | |
PointCloudConstPtr typedef | pcl::TextureMapping< PointInT > | |
PointCloudPtr typedef | pcl::TextureMapping< PointInT > | |
Ptr typedef | pcl::TextureMapping< PointInT > | |
removeOccludedPoints(const PointCloudPtr &input_cloud, PointCloudPtr &filtered_cloud, const double octree_voxel_size, std::vector< int > &visible_indices, std::vector< int > &occluded_indices) | pcl::TextureMapping< PointInT > | |
removeOccludedPoints(const pcl::TextureMesh &tex_mesh, pcl::TextureMesh &cleaned_mesh, const double octree_voxel_size) | pcl::TextureMapping< PointInT > | |
removeOccludedPoints(const pcl::TextureMesh &tex_mesh, PointCloudPtr &filtered_cloud, const double octree_voxel_size) | pcl::TextureMapping< PointInT > | |
setF(float f) | pcl::TextureMapping< PointInT > | inline |
setMaxAngle(float maxAngle) | pcl::TextureMapping< PointInT > | inline |
setMaxDepthError(float maxDepthError) | pcl::TextureMapping< PointInT > | inline |
setMaxDistance(float maxDistance) | pcl::TextureMapping< PointInT > | inline |
setMinClusterSize(int size) | pcl::TextureMapping< PointInT > | inline |
setTextureFiles(std::vector< std::string > tex_files) | pcl::TextureMapping< PointInT > | inline |
setTextureMaterials(TexMaterial tex_material) | pcl::TextureMapping< PointInT > | inline |
setVectorField(float x, float y, float z) | pcl::TextureMapping< PointInT > | inline |
showOcclusions(const PointCloudPtr &input_cloud, pcl::PointCloud< pcl::PointXYZI >::Ptr &colored_cloud, const double octree_voxel_size, const bool show_nb_occlusions=true, const int max_occlusions=4) | pcl::TextureMapping< PointInT > | |
showOcclusions(pcl::TextureMesh &tex_mesh, pcl::PointCloud< pcl::PointXYZI >::Ptr &colored_cloud, double octree_voxel_size, bool show_nb_occlusions=true, int max_occlusions=4) | pcl::TextureMapping< PointInT > | |
sortFacesByCamera(pcl::TextureMesh &tex_mesh, pcl::TextureMesh &sorted_mesh, const pcl::texture_mapping::CameraVector &cameras, const double octree_voxel_size, PointCloud &visible_pts) | pcl::TextureMapping< PointInT > | |
tex_files_ | pcl::TextureMapping< PointInT > | protected |
tex_material_ | pcl::TextureMapping< PointInT > | protected |
TextureMapping() | pcl::TextureMapping< PointInT > | inline |
textureMeshwithMultipleCameras(pcl::TextureMesh &mesh, const pcl::texture_mapping::CameraVector &cameras) | pcl::TextureMapping< PointInT > | |
textureMeshwithMultipleCameras2(pcl::TextureMesh &mesh, const pcl::texture_mapping::CameraVector &cameras, const rtabmap::ProgressState *callback=0, std::vector< std::map< int, pcl::PointXY > > *vertexToPixels=0, bool distanceToCamPolicy=false) | pcl::TextureMapping< PointInT > | |
UvIndex typedef | pcl::TextureMapping< PointInT > | |
vector_field_ | pcl::TextureMapping< PointInT > | protected |
~TextureMapping() | pcl::TextureMapping< PointInT > | inline |