| aggregateRaytracingMap() | next_best_view::MapHelper | inlineprivate |
| doRaytracing(const SimpleVector3 &fromPoint, const SimpleVector3 &toPoint) | next_best_view::MapHelper | inline |
| doRaytracing(const SimpleVector3 &fromPoint, const SimpleVector3 &toPoint, Ray &ray) | next_best_view::MapHelper | inline |
| getCollisionThreshold() | next_best_view::MapHelper | inline |
| getCostmapOccupancyValue(const SimpleVector3 &position) | next_best_view::MapHelper | inline |
| getCostmapOccupancyValue(const int32_t &mapX, const int32_t &mapY) | next_best_view::MapHelper | inline |
| getMapOccupancyValue(const SimpleVector3 &position) | next_best_view::MapHelper | inline |
| getMapOccupancyValue(const int32_t &mapX, const int32_t &mapY) | next_best_view::MapHelper | inline |
| getMetricHeight() | next_best_view::MapHelper | inline |
| getMetricWidth() | next_best_view::MapHelper | inline |
| getOccupancyValue(const nav_msgs::OccupancyGrid &map, const SimpleVector3 &position) | next_best_view::MapHelper | inlineprivate |
| getOccupancyValue(const costmap_2d::Costmap2D &costmap, const SimpleVector3 &position) | next_best_view::MapHelper | inlineprivate |
| getOccupancyValue(const nav_msgs::OccupancyGrid &map, const int32_t &mapX, const int32_t &mapY) | next_best_view::MapHelper | inlineprivate |
| getOccupancyValue(const costmap_2d::Costmap2D &costmap, const int32_t &mapX, const int32_t &mapY) | next_best_view::MapHelper | inlineprivate |
| getOrientation() | next_best_view::MapHelper | inline |
| getRaytracingMapOccupancyValue(const SimpleVector3 &position) | next_best_view::MapHelper | inline |
| getRaytracingMapOccupancyValue(const int32_t &mapX, const int32_t &mapY) | next_best_view::MapHelper | inline |
| getSquaredDistance(const SimpleVector3 &start, const SimpleVector3 &goal) | next_best_view::MapHelper | inline |
| getTranslation() | next_best_view::MapHelper | inline |
| isOccupancyValueAcceptable(const int8_t &occupancyValue) | next_best_view::MapHelper | inline |
| MapHelper(const std::string &mapTopicName="map", const std::string &getPlanServiceName="move_base/make_plan") | next_best_view::MapHelper | inline |
| mapReceived(nav_msgs::OccupancyGrid map) | next_best_view::MapHelper | inlineprivate |
| mapToWorldCoordinates(const int32_t &x, const int32_t &y, SimpleVector3 &result) | next_best_view::MapHelper | inline |
| mapToWorldCoordinates(const SimpleVector3 &position, SimpleVector3 &result) | next_best_view::MapHelper | inline |
| mapToWorldSize(const double &size, double &result) | next_best_view::MapHelper | inline |
| mCollisionThreshold | next_best_view::MapHelper | private |
| mCostmap | next_best_view::MapHelper | private |
| mCostTranslationTable | next_best_view::MapHelper | private |
| mDebugHelperPtr | next_best_view::MapHelper | private |
| mGetPlanServiceClient | next_best_view::MapHelper | private |
| mGlobalNodeHandle | next_best_view::MapHelper | private |
| mMap | next_best_view::MapHelper | private |
| mMapReceived | next_best_view::MapHelper | private |
| mRaytracingMap | next_best_view::MapHelper | private |
| setCollisionThreshold(int8_t thresholdValue) | next_best_view::MapHelper | inline |
| setCostmap() | next_best_view::MapHelper | inlineprivate |
| worldToMapCoordinates(const SimpleVector3 &position, int32_t &x, int32_t &y) | next_best_view::MapHelper | inline |
| worldToMapCoordinates(const SimpleVector3 &position, SimpleVector3 &result) | next_best_view::MapHelper | inline |
| worldToMapSize(const double &size, double &result) | next_best_view::MapHelper | inline |
| ~MapHelper() | next_best_view::MapHelper | inlinevirtual |