pcl::octree::OctreePointCloudDensity< PointT, LeafT, BranchT > Member List
This is the complete list of members for pcl::octree::OctreePointCloudDensity< PointT, LeafT, BranchT >, including all inherited members.
addData(unsigned int idxX_arg, unsigned int idxY_arg, unsigned int idxZ_arg, const int &data_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
addData(const OctreeKey &key_arg, const int &data_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
addDataToLeafRecursive(const OctreeKey &key_arg, unsigned int depthMask_arg, const int &data_arg, BranchNode *branch_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
addPointFromCloud(const int pointIdx_arg, IndicesPtr indices_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
addPointIdx(const int pointIdx_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
addPointsFromInputCloud()pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
addPointToCloud(const PointT &point_arg, PointCloudPtr cloud_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
addPointToCloud(const PointT &point_arg, PointCloudPtr cloud_arg, IndicesPtr indices_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
adoptBoundingBoxToPoint(const PointT &pointIdx_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
AlignedPointTVector typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
Base typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
boundingBoxDefined_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
branchCount_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
branchHasChild(const BranchNode &branch_arg, unsigned char childIdx_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
BranchNode typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
branchNodePool_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
branchReset(BranchNode &branch_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
BreadthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
ConstBreadthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
ConstDepthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
ConstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
ConstLeafNodeIterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
ConstPtr typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
createBranchChild(BranchNode &branch_arg, unsigned char childIdx_arg, BranchNode *&newBranchChild_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
createLeafChild(BranchNode &branch_arg, unsigned char childIdx_arg, LeafNode *&newLeafChild_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
defineBoundingBox()pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
defineBoundingBox(const double minX_arg, const double minY_arg, const double minZ_arg, const double maxX_arg, const double maxY_arg, const double maxZ_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
defineBoundingBox(const double maxX_arg, const double maxY_arg, const double maxZ_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
defineBoundingBox(const double cubeLen_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
deleteBranch(BranchNode &branch_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
deleteBranchChild(BranchNode &branch_arg, unsigned char childIdx_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
deleteLeafRecursive(const OctreeKey &key_arg, unsigned int depthMask_arg, BranchNode *branch_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
deleteTree(bool freeMemory_arg=false)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
deleteVoxelAtPoint(const PointT &point_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
deleteVoxelAtPoint(const int &pointIdx_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
DepthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
depthMask_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
deserializeTree(std::vector< char > &binaryTreeIn_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
deserializeTree(std::vector< char > &binaryTreeIn_arg, std::vector< int > &dataVector_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
deserializeTreeCallback(LeafNode &, const OctreeKey &)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected, virtual]
deserializeTreeRecursive(BranchNode *branch_arg, unsigned int depthMask_arg, OctreeKey &key_arg, typename std::vector< char >::const_iterator &binaryTreeIT_arg, typename std::vector< char >::const_iterator &binaryTreeIT_End_arg, typename std::vector< int >::const_iterator *dataVectorIterator_arg, typename std::vector< int >::const_iterator *dataVectorEndIterator_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
DoubleBuffer typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
enableDynamicDepth(size_t maxObjsPerLeaf)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline]
epsilon_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
existLeaf(unsigned int idxX_arg, unsigned int idxY_arg, unsigned int idxZ_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT >
existLeaf(const OctreeKey &key_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
findLeaf(const OctreeKey &key_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
findLeafAtPoint(const PointT &point_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
findLeafRecursive(const OctreeKey &key_arg, unsigned int depthMask_arg, BranchNode *branch_arg, LeafNode *&result_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
genDataTByOctreeKey(const OctreeKey &, int &) constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected, virtual]
genLeafNodeCenterFromOctreeKey(const OctreeKey &key_arg, PointT &point_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
genOctreeKeyForDataT(const int &data_arg, OctreeKey &key_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected, virtual]
genOctreeKeyforPoint(const PointT &point_arg, OctreeKey &key_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
genOctreeKeyforPoint(const double pointX_arg, const double pointY_arg, const double pointZ_arg, OctreeKey &key_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
genVoxelBoundsFromOctreeKey(const OctreeKey &key_arg, unsigned int treeDepth_arg, Eigen::Vector3f &min_pt, Eigen::Vector3f &max_pt) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
genVoxelCenterFromOctreeKey(const OctreeKey &key_arg, unsigned int treeDepth_arg, PointT &point_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
getApproxIntersectedVoxelCentersBySegment(const Eigen::Vector3f &origin, const Eigen::Vector3f &end, AlignedPointTVector &voxel_center_list, float precision=0.2)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
getBoundingBox(double &minX_arg, double &minY_arg, double &minZ_arg, double &maxX_arg, double &maxY_arg, double &maxZ_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
getBranchBitPattern(const BranchNode &branch_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
getBranchChildPtr(const BranchNode &branch_arg, unsigned char childIdx_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
getBranchCount() constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline]
getData(unsigned int idxX_arg, unsigned int idxY_arg, unsigned int idxZ_arg, int &data_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT >
getDataFromOctreeNode(const OctreeNode *node_arg, int &data_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
getDataFromOctreeNode(const OctreeNode *node_arg, std::vector< int > &data_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
getDataSizeFromOctreeNode(const OctreeNode *node_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
getEpsilon() constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
getIndices() constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
getInputCloud() constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
getKeyBitSize()pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
getLeafCount() constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline]
getOccupiedVoxelCenters(AlignedPointTVector &voxelCenterList_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
getOccupiedVoxelCentersRecursive(const BranchNode *node_arg, const OctreeKey &key_arg, AlignedPointTVector &voxelCenterList_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
getPointByIndex(const unsigned int index_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
getResolution() constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
getRootNode() constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
getTreeDepth() constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
getVoxelBounds(OctreeIteratorBase< int, OctreeBase< int, LeafT, BranchT > > &iterator, Eigen::Vector3f &min_pt, Eigen::Vector3f &max_pt)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
getVoxelDensityAtPoint(const PointT &point_arg) const pcl::octree::OctreePointCloudDensity< PointT, LeafT, BranchT > [inline]
getVoxelSquaredDiameter(unsigned int treeDepth_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
getVoxelSquaredDiameter() constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
getVoxelSquaredSideLen(unsigned int treeDepth_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
getVoxelSquaredSideLen() constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
indices_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
IndicesConstPtr typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
IndicesPtr typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
input_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
isPointWithinBoundingBox(const PointT &pointIdx_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline, protected]
isVoxelOccupiedAtPoint(const PointT &point_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
isVoxelOccupiedAtPoint(const double pointX_arg, const double pointY_arg, const double pointZ_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
isVoxelOccupiedAtPoint(const int &pointIdx_arg) constpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
Iterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
leafCount_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
LeafNode typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
LeafNodeIterator typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
leafNodePool_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
Log2(double n_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
maxKey_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
maxObjsPerLeaf_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
maxX_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
maxY_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
maxZ_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
minX_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
minY_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
minZ_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
MultipleObjsLeafContainer typedefpcl::octree::OctreeBase< int, LeafT, BranchT >
objectCount_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
OctreeBase()pcl::octree::OctreeBase< int, LeafT, BranchT >
OctreeBase(const OctreeBase &source)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline]
OctreeBreadthFirstIterator< DataT, OctreeT > classpcl::octree::OctreeBase< int, LeafT, BranchT > [friend]
octreeCanResize()pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
octreeDepth_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
OctreeDepthFirstIterator< DataT, OctreeT > classpcl::octree::OctreeBase< int, LeafT, BranchT > [friend]
OctreeIteratorBase< DataT, OctreeT > classpcl::octree::OctreeBase< int, LeafT, BranchT > [friend]
OctreeLeafNodeIterator< DataT, OctreeT > classpcl::octree::OctreeBase< int, LeafT, BranchT > [friend]
OctreePointCloud(const double resolution_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
OctreePointCloudDensity(const double resolution_arg)pcl::octree::OctreePointCloudDensity< PointT, LeafT, BranchT > [inline]
OctreeT typedefpcl::octree::OctreeBase< int, LeafT, BranchT >
operator=(const OctreeBase &source)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline]
PointCloud typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
PointCloudConstPtr typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
PointCloudPtr typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
poolCleanUp()pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
Ptr typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
removeLeaf(unsigned int idxX_arg, unsigned int idxY_arg, unsigned int idxZ_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
removeLeaf(const OctreeKey &key_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
resolution_pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [protected]
rootNode_pcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
serializeLeafs(std::vector< int > &dataVector_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
serializeTree(std::vector< char > &binaryTreeOut_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
serializeTree(std::vector< char > &binaryTreeOut_arg, std::vector< int > &dataVector_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
serializeTreeCallback(const LeafNode &, const OctreeKey &) constpcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected, virtual]
serializeTreeRecursive(const BranchNode *branch_arg, OctreeKey &key_arg, std::vector< char > *binaryTreeOut_arg, typename std::vector< int > *dataVector_arg) constpcl::octree::OctreeBase< int, LeafT, BranchT > [protected]
setBranchChildPtr(BranchNode &branch_arg, unsigned char childIdx_arg, OctreeNode *newChild_arg)pcl::octree::OctreeBase< int, LeafT, BranchT > [inline, protected]
setEpsilon(double eps)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
setInputCloud(const PointCloudConstPtr &cloud_arg, const IndicesConstPtr &indices_arg=IndicesConstPtr())pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
setMaxVoxelIndex(unsigned int maxVoxelIndex_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
setResolution(double resolution_arg)pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [inline]
setTreeDepth(unsigned int depth_arg)pcl::octree::OctreeBase< int, LeafT, BranchT >
SingleBuffer typedefpcl::octree::OctreePointCloud< PointT, LeafT, BranchT >
SingleObjLeafContainer typedefpcl::octree::OctreeBase< int, LeafT, BranchT >
~OctreeBase()pcl::octree::OctreeBase< int, LeafT, BranchT > [virtual]
~OctreePointCloud()pcl::octree::OctreePointCloud< PointT, LeafT, BranchT > [virtual]
~OctreePointCloudDensity()pcl::octree::OctreePointCloudDensity< PointT, LeafT, BranchT > [inline, virtual]


pcl
Author(s): Open Perception
autogenerated on Mon Oct 6 2014 03:20:18