, including all inherited members.
| AddTriangles(CoredMeshData *mesh, std::vector< CoredPointIndex > edges[3], std::vector< Point3D< float > > *interiorPositions, const int &offSet) | pcl::poisson::Octree< Degree > | [private, static] |
| AddTriangles(CoredMeshData *mesh, std::vector< CoredPointIndex > &edges, std::vector< Point3D< float > > *interiorPositions, const int &offSet, bool addBarycenter, bool polygonMesh) | pcl::poisson::Octree< Degree > | [private, static] |
| ClipTree(void) | pcl::poisson::Octree< Degree > | |
| EdgeRootCount(const TreeOctNode *node, const int &edgeIndex, const int &maxDepth) | pcl::poisson::Octree< Degree > | [private, static] |
| fData | pcl::poisson::Octree< Degree > | |
| finalize1(const int &refineNeighbors=-1) | pcl::poisson::Octree< Degree > | |
| finalize2(const int &refineNeighbors=-1) | pcl::poisson::Octree< Degree > | |
| getCenterValue(const TreeOctNode *node) | pcl::poisson::Octree< Degree > | [private] |
| getCornerValue(const TreeOctNode *node, const int &corner) | pcl::poisson::Octree< Degree > | [private] |
| getCornerValueAndNormal(const TreeOctNode *node, const int &corner, Real &value, Point3D< Real > &normal) | pcl::poisson::Octree< Degree > | [private] |
| GetDivergence(const int index[DIMENSION], const Point3D< Real > &normal) const | pcl::poisson::Octree< Degree > | [private] |
| GetDotProduct(const int index[DIMENSION]) const | pcl::poisson::Octree< Degree > | [private] |
| GetEdgeLoops(std::vector< std::pair< long long, long long > > &edges, std::vector< std::vector< std::pair< long long, long long > > > &loops) | pcl::poisson::Octree< Degree > | [private, static] |
| GetFixedDepthLaplacian(SparseSymmetricMatrix< float > &matrix, const int &depth, const SortedTreeNodes &sNodes) | pcl::poisson::Octree< Degree > | [private] |
| GetIsoValue(void) | pcl::poisson::Octree< Degree > | |
| GetLaplacian(const int index[DIMENSION]) const | pcl::poisson::Octree< Degree > | [private] |
| GetMCIsoEdges(TreeOctNode *node, hash_map< long long, int > &boundaryRoots, hash_map< long long, int > *interiorRoots, const int &sDepth, std::vector< std::pair< long long, long long > > &edges) | pcl::poisson::Octree< Degree > | [private] |
| GetMCIsoTriangles(TreeOctNode *node, CoredMeshData *mesh, hash_map< long long, int > &boundaryRoots, hash_map< long long, int > *interiorRoots, std::vector< Point3D< float > > *interiorPositions, const int &offSet, const int &sDepth, bool addBarycenter, bool polygonMesh) | pcl::poisson::Octree< Degree > | [private] |
| GetMCIsoTriangles(const Real &isoValue, CoredMeshData *mesh, const int &fullDepthIso=0, const int &nonLinearFit=1, bool addBarycenter=false, bool polygonMesh=false) | pcl::poisson::Octree< Degree > | |
| GetMCIsoTriangles(const Real &isoValue, const int &subdivideDepth, CoredMeshData *mesh, const int &fullDepthIso=0, const int &nonLinearFit=1, bool addBarycenter=false, bool polygonMesh=false) | pcl::poisson::Octree< Degree > | |
| GetRestrictedFixedDepthLaplacian(SparseSymmetricMatrix< float > &matrix, const int &depth, const int *entries, const int &entryCount, const TreeOctNode *rNode, const Real &radius, const SortedTreeNodes &sNodes) | pcl::poisson::Octree< Degree > | [private] |
| GetRoot(const RootInfo &ri, const Real &isoValue, const int &maxDepth, Point3D< Real > &position, hash_map< long long, std::pair< Real, Point3D< Real > > > &normalHash, Point3D< Real > *normal, const int &nonLinearFit) | pcl::poisson::Octree< Degree > | [private] |
| GetRoot(const RootInfo &ri, const Real &isoValue, Point3D< Real > &position, hash_map< long long, std::pair< Real, Point3D< Real > > > &normalHash, const int &nonLinearFit) | pcl::poisson::Octree< Degree > | [private] |
| GetRootIndex(const TreeOctNode *node, const int &edgeIndex, const int &maxDepth, RootInfo &ri) | pcl::poisson::Octree< Degree > | [private, static] |
| GetRootIndex(const TreeOctNode *node, const int &edgeIndex, const int &maxDepth, const int &sDepth, RootInfo &ri) | pcl::poisson::Octree< Degree > | [private, static] |
| GetRootIndex(const long long &key, hash_map< long long, int > &boundaryRoots, hash_map< long long, int > *interiorRoots, CoredPointIndex &index) | pcl::poisson::Octree< Degree > | [private, static] |
| GetRootPair(const RootInfo &root, const int &maxDepth, RootInfo &pair) | pcl::poisson::Octree< Degree > | [private, static] |
| HasNormals(TreeOctNode *node, const Real &epsilon) | pcl::poisson::Octree< Degree > | [private] |
| InteriorFaceRootCount(const TreeOctNode *node, const int &faceIndex, const int &maxDepth) | pcl::poisson::Octree< Degree > | [private, static] |
| IsBoundaryEdge(const TreeOctNode *node, const int &edgeIndex, const int &subdivideDepth) | pcl::poisson::Octree< Degree > | [private, static] |
| IsBoundaryEdge(const TreeOctNode *node, const int &dir, const int &x, const int &y, const int &subidivideDepth) | pcl::poisson::Octree< Degree > | [private, static] |
| IsBoundaryFace(const TreeOctNode *node, const int &faceIndex, const int &subdivideDepth) | pcl::poisson::Octree< Degree > | [private, static] |
| LaplacianMatrixIteration(const int &subdivideDepth) | pcl::poisson::Octree< Degree > | |
| maxMemoryUsage | pcl::poisson::Octree< Degree > | [static] |
| MemoryUsage() | pcl::poisson::Octree< Degree > | [static] |
| neighborKey | pcl::poisson::Octree< Degree > | [private] |
| neighborKey2 | pcl::poisson::Octree< Degree > | [private] |
| NonLinearGetSampleDepthAndWeight(TreeOctNode *node, const Point3D< Real > &position, const Real &samplesPerNode, Real &depth, Real &weight) | pcl::poisson::Octree< Degree > | [private] |
| NonLinearGetSampleWeight(TreeOctNode *node, const Point3D< Real > &position) | pcl::poisson::Octree< Degree > | [private] |
| NonLinearSplatOrientedPoint(TreeOctNode *node, const Point3D< Real > &point, const Point3D< Real > &normal) | pcl::poisson::Octree< Degree > | [private] |
| NonLinearSplatOrientedPoint(const Point3D< Real > &point, const Point3D< Real > &normal, const int &kernelDepth, const Real &samplesPerNode, const int &minDepth, const int &maxDepth) | pcl::poisson::Octree< Degree > | [private] |
| NonLinearUpdateWeightContribution(TreeOctNode *node, const Point3D< Real > &position, const Real &weight=Real(1.0)) | pcl::poisson::Octree< Degree > | [private] |
| normals | pcl::poisson::Octree< Degree > | |
| Octree() | pcl::poisson::Octree< Degree > | |
| postNormalSmooth | pcl::poisson::Octree< Degree > | |
| PreValidate(const Real &isoValue, const int &maxDepth, const int &subdivideDepth) | pcl::poisson::Octree< Degree > | [private] |
| PreValidate(TreeOctNode *node, const Real &isoValue, const int &maxDepth, const int &subdivideDepth) | pcl::poisson::Octree< Degree > | [private] |
| radius | pcl::poisson::Octree< Degree > | [private] |
| SetBoundaryMCRootPositions(const int &sDepth, const Real &isoValue, hash_map< long long, int > &boundaryRoots, hash_map< long long, std::pair< Real, Point3D< Real > > > &boundaryNormalHash, CoredMeshData *mesh, const int &nonLinearFit) | pcl::poisson::Octree< Degree > | [private] |
| setFunctionData(const PPolynomial< Degree > &ReconstructionFunction, const int &maxDepth, const int &normalize, const Real &normalSmooth=-1) | pcl::poisson::Octree< Degree > | |
| SetIsoSurfaceCorners(const Real &isoValue, const int &subdivisionDepth, const int &fullDepthIso) | pcl::poisson::Octree< Degree > | [private] |
| SetLaplacianWeights(void) | pcl::poisson::Octree< Degree > | |
| SetMCRootPositions(TreeOctNode *node, const int &sDepth, const Real &isoValue, hash_map< long long, int > &boundaryRoots, hash_map< long long, int > *interiorRoots, hash_map< long long, std::pair< Real, Point3D< Real > > > &boundaryNormalHash, hash_map< long long, std::pair< Real, Point3D< Real > > > *interiorNormalHash, std::vector< Point3D< float > > *interiorPositions, CoredMeshData *mesh, const int &nonLinearFit) | pcl::poisson::Octree< Degree > | [private] |
| setNodeIndices(TreeOctNode &tree, int &idx) | pcl::poisson::Octree< Degree > | [private] |
| setTree(boost::shared_ptr< const pcl::PointCloud< PointNT > > input_, const int &maxDepth, const int &kernelDepth, const Real &samplesPerNode, const Real &scaleFactor, Point3D< Real > ¢er, Real &scale, const int &resetSamples, const int &useConfidence) | pcl::poisson::Octree< Degree > | |
| SolveFixedDepthMatrix(const int &depth, const SortedTreeNodes &sNodes) | pcl::poisson::Octree< Degree > | [private] |
| SolveFixedDepthMatrix(const int &depth, const int &startingDepth, const SortedTreeNodes &sNodes) | pcl::poisson::Octree< Degree > | [private] |
| Subdivide(TreeOctNode *node, const Real &isoValue, const int &maxDepth) | pcl::poisson::Octree< Degree > | [private] |
| tree | pcl::poisson::Octree< Degree > | |
| Validate(TreeOctNode *node, const Real &isoValue, const int &maxDepth, const int &fullDepthIso, const int &subdivideDepth) | pcl::poisson::Octree< Degree > | [private] |
| Validate(TreeOctNode *node, const Real &isoValue, const int &maxDepth, const int &fullDepthIso) | pcl::poisson::Octree< Degree > | [private] |
| width | pcl::poisson::Octree< Degree > | [private] |