#include <MapModel.h>
Public Member Functions | |
virtual double | getFloorHeight (const tf::Transform &pose) const |
virtual bool | isOccupied (octomap::OcTreeNode *node) const |
OccupancyMap (ros::NodeHandle *nh) | |
virtual | ~OccupancyMap () |
Public Member Functions inherited from humanoid_localization::MapModel | |
void | getHeightlist (double x, double y, double totalHeight, std::vector< double > &heights) |
boost::shared_ptr< octomap::OcTree > | getMap () const |
virtual void | initGlobal (Particles &particles, double z, double roll, double pitch, const Vector6d &initNoise, UniformGeneratorT &rngUniform, NormalGeneratorT &rngNormal) |
virtual bool | isOccupied (const octomap::point3d &position) const |
MapModel (ros::NodeHandle *nh) | |
virtual void | verifyPoses (Particles &particles) |
virtual | ~MapModel () |
Additional Inherited Members | |
Protected Attributes inherited from humanoid_localization::MapModel | |
boost::shared_ptr< octomap::OcTree > | m_map |
double | m_motionMeanZ |
double | m_motionObstacleDist |
double | m_motionRangePitch |
double | m_motionRangeRoll |
double | m_motionRangeZ |
Definition at line 97 of file MapModel.h.
humanoid_localization::OccupancyMap::OccupancyMap | ( | ros::NodeHandle * | nh | ) |
Definition at line 259 of file MapModel.cpp.
|
virtual |
Definition at line 292 of file MapModel.cpp.
|
virtual |
Implements humanoid_localization::MapModel.
Definition at line 301 of file MapModel.cpp.
|
virtual |
Implements humanoid_localization::MapModel.
Definition at line 296 of file MapModel.cpp.