#include <MapHelper.hpp>
|
bool | doRaytracing (const SimpleVector3 &fromPoint, const SimpleVector3 &toPoint) |
|
bool | doRaytracing (const SimpleVector3 &fromPoint, const SimpleVector3 &toPoint, Ray &ray) |
|
int8_t | getCollisionThreshold () |
|
int8_t | getCostmapOccupancyValue (const SimpleVector3 &position) |
|
int8_t | getCostmapOccupancyValue (const int32_t &mapX, const int32_t &mapY) |
|
int8_t | getMapOccupancyValue (const SimpleVector3 &position) |
|
int8_t | getMapOccupancyValue (const int32_t &mapX, const int32_t &mapY) |
|
float | getMetricHeight () |
|
float | getMetricWidth () |
|
SimpleQuaternion | getOrientation () |
|
int8_t | getRaytracingMapOccupancyValue (const SimpleVector3 &position) |
|
int8_t | getRaytracingMapOccupancyValue (const int32_t &mapX, const int32_t &mapY) |
|
float | getSquaredDistance (const SimpleVector3 &start, const SimpleVector3 &goal) |
|
SimpleVector3 | getTranslation () |
|
bool | isOccupancyValueAcceptable (const int8_t &occupancyValue) |
|
| MapHelper (const std::string &mapTopicName="map", const std::string &getPlanServiceName="move_base/make_plan") |
|
void | mapToWorldCoordinates (const int32_t &x, const int32_t &y, SimpleVector3 &result) |
|
void | mapToWorldCoordinates (const SimpleVector3 &position, SimpleVector3 &result) |
|
void | mapToWorldSize (const double &size, double &result) |
|
void | setCollisionThreshold (int8_t thresholdValue) |
|
void | worldToMapCoordinates (const SimpleVector3 &position, int32_t &x, int32_t &y) |
|
void | worldToMapCoordinates (const SimpleVector3 &position, SimpleVector3 &result) |
|
void | worldToMapSize (const double &size, double &result) |
|
virtual | ~MapHelper () |
|
Definition at line 62 of file MapHelper.hpp.
robot_model_services::MapHelper::MapHelper |
( |
const std::string & |
mapTopicName = "map" , |
|
|
const std::string & |
getPlanServiceName = "move_base/make_plan" |
|
) |
| |
|
inline |
virtual robot_model_services::MapHelper::~MapHelper |
( |
| ) |
|
|
inlinevirtual |
void robot_model_services::MapHelper::aggregateRaytracingMap |
( |
| ) |
|
|
inlineprivate |
int8_t robot_model_services::MapHelper::getCollisionThreshold |
( |
| ) |
|
|
inline |
int8_t robot_model_services::MapHelper::getCostmapOccupancyValue |
( |
const SimpleVector3 & |
position | ) |
|
|
inline |
int8_t robot_model_services::MapHelper::getCostmapOccupancyValue |
( |
const int32_t & |
mapX, |
|
|
const int32_t & |
mapY |
|
) |
| |
|
inline |
int8_t robot_model_services::MapHelper::getMapOccupancyValue |
( |
const SimpleVector3 & |
position | ) |
|
|
inline |
int8_t robot_model_services::MapHelper::getMapOccupancyValue |
( |
const int32_t & |
mapX, |
|
|
const int32_t & |
mapY |
|
) |
| |
|
inline |
float robot_model_services::MapHelper::getMetricHeight |
( |
| ) |
|
|
inline |
float robot_model_services::MapHelper::getMetricWidth |
( |
| ) |
|
|
inline |
int8_t robot_model_services::MapHelper::getOccupancyValue |
( |
const nav_msgs::OccupancyGrid & |
map, |
|
|
const SimpleVector3 & |
position |
|
) |
| |
|
inlineprivate |
int8_t robot_model_services::MapHelper::getOccupancyValue |
( |
const nav_msgs::OccupancyGrid & |
map, |
|
|
const int32_t & |
mapX, |
|
|
const int32_t & |
mapY |
|
) |
| |
|
inlineprivate |
int8_t robot_model_services::MapHelper::getOccupancyValue |
( |
const costmap_2d::Costmap2D & |
costmap, |
|
|
const int32_t & |
mapX, |
|
|
const int32_t & |
mapY |
|
) |
| |
|
inlineprivate |
int8_t robot_model_services::MapHelper::getRaytracingMapOccupancyValue |
( |
const SimpleVector3 & |
position | ) |
|
|
inline |
int8_t robot_model_services::MapHelper::getRaytracingMapOccupancyValue |
( |
const int32_t & |
mapX, |
|
|
const int32_t & |
mapY |
|
) |
| |
|
inline |
SimpleVector3 robot_model_services::MapHelper::getTranslation |
( |
| ) |
|
|
inline |
bool robot_model_services::MapHelper::isOccupancyValueAcceptable |
( |
const int8_t & |
occupancyValue | ) |
|
|
inline |
void robot_model_services::MapHelper::mapReceived |
( |
nav_msgs::OccupancyGrid |
map | ) |
|
|
inlineprivate |
void robot_model_services::MapHelper::mapToWorldCoordinates |
( |
const int32_t & |
x, |
|
|
const int32_t & |
y, |
|
|
SimpleVector3 & |
result |
|
) |
| |
|
inline |
void robot_model_services::MapHelper::mapToWorldSize |
( |
const double & |
size, |
|
|
double & |
result |
|
) |
| |
|
inline |
void robot_model_services::MapHelper::setCollisionThreshold |
( |
int8_t |
thresholdValue | ) |
|
|
inline |
void robot_model_services::MapHelper::setCostmap |
( |
| ) |
|
|
inlineprivate |
void robot_model_services::MapHelper::worldToMapCoordinates |
( |
const SimpleVector3 & |
position, |
|
|
int32_t & |
x, |
|
|
int32_t & |
y |
|
) |
| |
|
inline |
void robot_model_services::MapHelper::worldToMapSize |
( |
const double & |
size, |
|
|
double & |
result |
|
) |
| |
|
inline |
int8_t robot_model_services::MapHelper::mCollisionThreshold |
|
private |
int8_t robot_model_services::MapHelper::mCostTranslationTable[256] |
|
private |
nav_msgs::OccupancyGrid robot_model_services::MapHelper::mMap |
|
private |
bool robot_model_services::MapHelper::mMapReceived |
|
private |
nav_msgs::OccupancyGrid robot_model_services::MapHelper::mRaytracingMap |
|
private |
The documentation for this class was generated from the following file:
asr_robot_model_services
Author(s): Aumann Florian, Borella Jocelyn, Heller Florian, Meißner Pascal, Schleicher Ralf, Stöckle Patrick, Stroh Daniel, Trautmann Jeremias, Walter Milena, Wittenbeck Valerij
autogenerated on Mon Jun 10 2019 12:50:00