#include <OctoMap.h>
|
const std::map< int, Transform > & | addedNodes () const |
|
void | addToCache (int nodeId, const pcl::PointCloud< pcl::PointXYZRGB >::Ptr &ground, const pcl::PointCloud< pcl::PointXYZRGB >::Ptr &obstacles, const pcl::PointXYZ &viewPoint) |
|
void | addToCache (int nodeId, const cv::Mat &ground, const cv::Mat &obstacles, const cv::Mat &empty, const cv::Point3f &viewPoint) |
|
void | clear () |
|
pcl::PointCloud< pcl::PointXYZRGB >::Ptr | createCloud (unsigned int treeDepth=0, std::vector< int > *obstacleIndices=0, std::vector< int > *emptyIndices=0, std::vector< int > *groundIndices=0, bool originalRefPoints=true, std::vector< int > *frontierIndices=0, std::vector< double > *cloudProb=0) const |
|
cv::Mat | createProjectionMap (float &xMin, float &yMin, float &gridCellSize, float minGridSize=0.0f, unsigned int treeDepth=0) |
|
void | getGridMax (double &x, double &y, double &z) const |
|
void | getGridMin (double &x, double &y, double &z) const |
|
bool | hasColor () const |
|
| OctoMap (const ParametersMap ¶meters=ParametersMap()) |
|
const RtabmapColorOcTree * | octree () const |
|
void | setMaxRange (float value) |
|
void | setRayTracing (bool enabled) |
|
bool | update (const std::map< int, Transform > &poses) |
|
bool | writeBinary (const std::string &path) |
|
virtual | ~OctoMap () |
|
|
static octomap::point3d | findCloseEmpty (RtabmapColorOcTree *octree_, unsigned int treeDepth, octomap::point3d startPosition) |
|
static std::unordered_set< octomap::OcTreeKey, octomap::OcTreeKey::KeyHash > | findEmptyNode (RtabmapColorOcTree *octree_, unsigned int treeDepth, octomap::point3d startPosition) |
|
static void | floodFill (RtabmapColorOcTree *octree_, unsigned int treeDepth, octomap::point3d startPosition, std::unordered_set< octomap::OcTreeKey, octomap::OcTreeKey::KeyHash > &EmptyNodes, std::queue< octomap::point3d > &positionToExplore) |
|
static bool | isNodeVisited (std::unordered_set< octomap::OcTreeKey, octomap::OcTreeKey::KeyHash > const &EmptyNodes, octomap::OcTreeKey const key) |
|
static bool | isValidEmpty (RtabmapColorOcTree *octree_, unsigned int treeDepth, octomap::point3d startPosition) |
|
Definition at line 174 of file OctoMap.h.
◆ OctoMap()
◆ ~OctoMap()
rtabmap::OctoMap::~OctoMap |
( |
| ) |
|
|
virtual |
◆ addedNodes()
const std::map<int, Transform>& rtabmap::OctoMap::addedNodes |
( |
| ) |
const |
|
inline |
◆ addToCache() [1/2]
void rtabmap::OctoMap::addToCache |
( |
int |
nodeId, |
|
|
const pcl::PointCloud< pcl::PointXYZRGB >::Ptr & |
ground, |
|
|
const pcl::PointCloud< pcl::PointXYZRGB >::Ptr & |
obstacles, |
|
|
const pcl::PointXYZ & |
viewPoint |
|
) |
| |
◆ addToCache() [2/2]
void rtabmap::OctoMap::addToCache |
( |
int |
nodeId, |
|
|
const cv::Mat & |
ground, |
|
|
const cv::Mat & |
obstacles, |
|
|
const cv::Mat & |
empty, |
|
|
const cv::Point3f & |
viewPoint |
|
) |
| |
◆ clear()
void rtabmap::OctoMap::clear |
( |
| ) |
|
◆ createCloud()
pcl::PointCloud< pcl::PointXYZRGB >::Ptr rtabmap::OctoMap::createCloud |
( |
unsigned int |
treeDepth = 0 , |
|
|
std::vector< int > * |
obstacleIndices = 0 , |
|
|
std::vector< int > * |
emptyIndices = 0 , |
|
|
std::vector< int > * |
groundIndices = 0 , |
|
|
bool |
originalRefPoints = true , |
|
|
std::vector< int > * |
frontierIndices = 0 , |
|
|
std::vector< double > * |
cloudProb = 0 |
|
) |
| const |
◆ createProjectionMap()
cv::Mat rtabmap::OctoMap::createProjectionMap |
( |
float & |
xMin, |
|
|
float & |
yMin, |
|
|
float & |
gridCellSize, |
|
|
float |
minGridSize = 0.0f , |
|
|
unsigned int |
treeDepth = 0 |
|
) |
| |
◆ findCloseEmpty()
◆ findEmptyNode()
◆ floodFill()
◆ getGridMax()
void rtabmap::OctoMap::getGridMax |
( |
double & |
x, |
|
|
double & |
y, |
|
|
double & |
z |
|
) |
| const |
|
inline |
◆ getGridMin()
void rtabmap::OctoMap::getGridMin |
( |
double & |
x, |
|
|
double & |
y, |
|
|
double & |
z |
|
) |
| const |
|
inline |
◆ hasColor()
bool rtabmap::OctoMap::hasColor |
( |
| ) |
const |
|
inline |
◆ isNodeVisited()
◆ isValidEmpty()
◆ octree()
◆ setMaxRange()
void rtabmap::OctoMap::setMaxRange |
( |
float |
value | ) |
|
|
inline |
◆ setRayTracing()
void rtabmap::OctoMap::setRayTracing |
( |
bool |
enabled | ) |
|
|
inline |
◆ update()
bool rtabmap::OctoMap::update |
( |
const std::map< int, Transform > & |
poses | ) |
|
◆ updateMinMax()
◆ writeBinary()
bool rtabmap::OctoMap::writeBinary |
( |
const std::string & |
path | ) |
|
◆ addedNodes_
std::map<int, Transform> rtabmap::OctoMap::addedNodes_ |
|
private |
◆ cache_
std::map<int, std::pair<std::pair<cv::Mat, cv::Mat>, cv::Mat> > rtabmap::OctoMap::cache_ |
|
private |
◆ cacheClouds_
std::map<int, std::pair<const pcl::PointCloud<pcl::PointXYZRGB>::Ptr, const pcl::PointCloud<pcl::PointXYZRGB>::Ptr> > rtabmap::OctoMap::cacheClouds_ |
|
private |
◆ cacheViewPoints_
std::map<int, cv::Point3f> rtabmap::OctoMap::cacheViewPoints_ |
|
private |
◆ emptyFloodFillDepth_
unsigned int rtabmap::OctoMap::emptyFloodFillDepth_ |
|
private |
◆ fullUpdate_
bool rtabmap::OctoMap::fullUpdate_ |
|
private |
◆ hasColor_
bool rtabmap::OctoMap::hasColor_ |
|
private |
◆ maxValues_
double rtabmap::OctoMap::maxValues_[3] |
|
private |
◆ minValues_
double rtabmap::OctoMap::minValues_[3] |
|
private |
◆ octree_
◆ rangeMax_
float rtabmap::OctoMap::rangeMax_ |
|
private |
◆ rayTracing_
bool rtabmap::OctoMap::rayTracing_ |
|
private |
◆ updateError_
float rtabmap::OctoMap::updateError_ |
|
private |
The documentation for this class was generated from the following files: