pcl::octree::OctreePointCloudPointVector< PointT, LeafContainerT, BranchContainerT, OctreeT > Member List
This is the complete list of members for pcl::octree::OctreePointCloudPointVector< PointT, LeafContainerT, BranchContainerT, OctreeT >, including all inherited members.
addPointFromCloud(const int point_idx_arg, IndicesPtr indices_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
addPointIdx(const int point_idx_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected, virtual]
addPointsFromInputCloud()pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
addPointToCloud(const PointT &point_arg, PointCloudPtr cloud_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
addPointToCloud(const PointT &point_arg, PointCloudPtr cloud_arg, IndicesPtr indices_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
adoptBoundingBoxToPoint(const PointT &point_idx_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
AlignedPointTVector typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
AlignedPointXYZVector typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
Base typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
bounding_box_defined_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
BranchNode typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
BreadthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
ConstBreadthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
ConstDepthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
ConstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
ConstLeafNodeIterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
ConstPtr typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
defineBoundingBox()pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
defineBoundingBox(const double min_x_arg, const double min_y_arg, const double min_z_arg, const double max_x_arg, const double max_y_arg, const double max_z_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
defineBoundingBox(const double max_x_arg, const double max_y_arg, const double max_z_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
defineBoundingBox(const double cubeLen_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
deleteTree()pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
deleteVoxelAtPoint(const PointT &point_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
deleteVoxelAtPoint(const int &point_idx_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
DepthFirstIterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
enableDynamicDepth(size_t maxObjsPerLeaf)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
epsilon_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
expandLeafNode(LeafNode *leaf_node, BranchNode *parent_branch, unsigned char child_idx, unsigned int depth_mask)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
findLeafAtPoint(const PointT &point_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline, protected]
genLeafNodeCenterFromOctreeKey(const OctreeKey &key_arg, PointT &point_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
genOctreeKeyForDataT(const int &data_arg, OctreeKey &key_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected, virtual]
genOctreeKeyforPoint(const PointT &point_arg, OctreeKey &key_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
genOctreeKeyforPoint(const double point_x_arg, const double point_y_arg, const double point_z_arg, OctreeKey &key_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
genVoxelBoundsFromOctreeKey(const OctreeKey &key_arg, unsigned int tree_depth_arg, Eigen::Vector3f &min_pt, Eigen::Vector3f &max_pt) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
genVoxelCenterFromOctreeKey(const OctreeKey &key_arg, unsigned int tree_depth_arg, PointT &point_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
getApproxIntersectedVoxelCentersBySegment(const Eigen::Vector3f &origin, const Eigen::Vector3f &end, AlignedPointTVector &voxel_center_list, float precision=0.2)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
getBoundingBox(double &min_x_arg, double &min_y_arg, double &min_z_arg, double &max_x_arg, double &max_y_arg, double &max_z_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
getEpsilon() const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
getIndices() const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
getInputCloud() const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
getKeyBitSize()pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
getOccupiedVoxelCenters(AlignedPointTVector &voxel_center_list_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
getOccupiedVoxelCentersRecursive(const BranchNode *node_arg, const OctreeKey &key_arg, AlignedPointTVector &voxel_center_list_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
getPointByIndex(const unsigned int index_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
getResolution() const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
getTreeDepth() const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
getVoxelBounds(OctreeIteratorBase< OctreeT > &iterator, Eigen::Vector3f &min_pt, Eigen::Vector3f &max_pt)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
getVoxelSquaredDiameter(unsigned int tree_depth_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
getVoxelSquaredDiameter() const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
getVoxelSquaredSideLen(unsigned int tree_depth_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
getVoxelSquaredSideLen() const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
indices_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
IndicesConstPtr typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
IndicesPtr typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
input_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
isPointWithinBoundingBox(const PointT &point_idx_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline, protected]
isVoxelOccupiedAtPoint(const PointT &point_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
isVoxelOccupiedAtPoint(const double point_x_arg, const double point_y_arg, const double point_z_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
isVoxelOccupiedAtPoint(const int &point_idx_arg) const pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
Iterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
LeafNode typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
LeafNodeIterator typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
max_objs_per_leaf_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
max_x_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
max_y_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
max_z_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
min_x_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
min_y_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
min_z_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
OctreePointCloud(const double resolution_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
OctreePointCloudPointVector(const double resolution_arg)pcl::octree::OctreePointCloudPointVector< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
PointCloud typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
PointCloudConstPtr typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
PointCloudPtr typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
Ptr typedefpcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT >
resolution_pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [protected]
setEpsilon(double eps)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
setInputCloud(const PointCloudConstPtr &cloud_arg, const IndicesConstPtr &indices_arg=IndicesConstPtr())pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
setResolution(double resolution_arg)pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline]
SingleBuffer typedefpcl::octree::OctreePointCloudPointVector< PointT, LeafContainerT, BranchContainerT, OctreeT >
~OctreePointCloud()pcl::octree::OctreePointCloud< PointT, LeafContainerT, BranchContainerT, OctreeT > [virtual]
~OctreePointCloudPointVector()pcl::octree::OctreePointCloudPointVector< PointT, LeafContainerT, BranchContainerT, OctreeT > [inline, virtual]


pcl
Author(s): Open Perception
autogenerated on Wed Aug 26 2015 15:44:31