Public Member Functions | Private Member Functions | Private Attributes | List of all members
next_best_view::MapHelper Class Reference

#include <MapHelper.hpp>

Public Member Functions

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 ()
 

Private Member Functions

void aggregateRaytracingMap ()
 
int8_t getOccupancyValue (const nav_msgs::OccupancyGrid &map, const SimpleVector3 &position)
 
int8_t getOccupancyValue (const costmap_2d::Costmap2D &costmap, const SimpleVector3 &position)
 
int8_t getOccupancyValue (const nav_msgs::OccupancyGrid &map, const int32_t &mapX, const int32_t &mapY)
 
int8_t getOccupancyValue (const costmap_2d::Costmap2D &costmap, const int32_t &mapX, const int32_t &mapY)
 
void mapReceived (nav_msgs::OccupancyGrid map)
 
void setCostmap ()
 

Private Attributes

int8_t mCollisionThreshold
 
costmap_2d::Costmap2D mCostmap
 
int8_t mCostTranslationTable [256]
 
DebugHelperPtr mDebugHelperPtr
 
ros::ServiceClient mGetPlanServiceClient
 
ros::NodeHandle mGlobalNodeHandle
 
nav_msgs::OccupancyGrid mMap
 
bool mMapReceived
 
nav_msgs::OccupancyGrid mRaytracingMap
 

Detailed Description

Definition at line 65 of file MapHelper.hpp.

Constructor & Destructor Documentation

next_best_view::MapHelper::MapHelper ( const std::string &  mapTopicName = "map",
const std::string &  getPlanServiceName = "move_base/make_plan" 
)
inline

We must wait for the map is published on the map server, to use the right map of the navigation.

Definition at line 79 of file MapHelper.hpp.

virtual next_best_view::MapHelper::~MapHelper ( )
inlinevirtual

Definition at line 117 of file MapHelper.hpp.

Member Function Documentation

void next_best_view::MapHelper::aggregateRaytracingMap ( )
inlineprivate

Definition at line 164 of file MapHelper.hpp.

bool next_best_view::MapHelper::doRaytracing ( const SimpleVector3 fromPoint,
const SimpleVector3 toPoint 
)
inline

Definition at line 251 of file MapHelper.hpp.

bool next_best_view::MapHelper::doRaytracing ( const SimpleVector3 fromPoint,
const SimpleVector3 toPoint,
Ray ray 
)
inline

Definition at line 260 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getCollisionThreshold ( )
inline

Definition at line 415 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getCostmapOccupancyValue ( const SimpleVector3 position)
inline

Definition at line 234 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getCostmapOccupancyValue ( const int32_t &  mapX,
const int32_t &  mapY 
)
inline

Definition at line 238 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getMapOccupancyValue ( const SimpleVector3 position)
inline

Definition at line 225 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getMapOccupancyValue ( const int32_t &  mapX,
const int32_t &  mapY 
)
inline

Definition at line 229 of file MapHelper.hpp.

float next_best_view::MapHelper::getMetricHeight ( )
inline

Definition at line 359 of file MapHelper.hpp.

float next_best_view::MapHelper::getMetricWidth ( )
inline

Definition at line 355 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getOccupancyValue ( const nav_msgs::OccupancyGrid &  map,
const SimpleVector3 position 
)
inlineprivate

Definition at line 188 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getOccupancyValue ( const costmap_2d::Costmap2D &  costmap,
const SimpleVector3 position 
)
inlineprivate

Definition at line 194 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getOccupancyValue ( const nav_msgs::OccupancyGrid &  map,
const int32_t &  mapX,
const int32_t &  mapY 
)
inlineprivate

Definition at line 200 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getOccupancyValue ( const costmap_2d::Costmap2D &  costmap,
const int32_t &  mapX,
const int32_t &  mapY 
)
inlineprivate

Definition at line 211 of file MapHelper.hpp.

SimpleQuaternion next_best_view::MapHelper::getOrientation ( )
inline

Definition at line 403 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getRaytracingMapOccupancyValue ( const SimpleVector3 position)
inline

Definition at line 243 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::getRaytracingMapOccupancyValue ( const int32_t &  mapX,
const int32_t &  mapY 
)
inline

Definition at line 247 of file MapHelper.hpp.

float next_best_view::MapHelper::getSquaredDistance ( const SimpleVector3 start,
const SimpleVector3 goal 
)
inline

Definition at line 419 of file MapHelper.hpp.

SimpleVector3 next_best_view::MapHelper::getTranslation ( )
inline

Definition at line 399 of file MapHelper.hpp.

bool next_best_view::MapHelper::isOccupancyValueAcceptable ( const int8_t &  occupancyValue)
inline

Definition at line 407 of file MapHelper.hpp.

void next_best_view::MapHelper::mapReceived ( nav_msgs::OccupancyGrid  map)
inlineprivate

Definition at line 122 of file MapHelper.hpp.

void next_best_view::MapHelper::mapToWorldCoordinates ( const int32_t &  x,
const int32_t &  y,
SimpleVector3 result 
)
inline

Definition at line 381 of file MapHelper.hpp.

void next_best_view::MapHelper::mapToWorldCoordinates ( const SimpleVector3 position,
SimpleVector3 result 
)
inline

Definition at line 385 of file MapHelper.hpp.

void next_best_view::MapHelper::mapToWorldSize ( const double &  size,
double &  result 
)
inline

Definition at line 391 of file MapHelper.hpp.

void next_best_view::MapHelper::setCollisionThreshold ( int8_t  thresholdValue)
inline

Definition at line 411 of file MapHelper.hpp.

void next_best_view::MapHelper::setCostmap ( )
inlineprivate

Definition at line 140 of file MapHelper.hpp.

void next_best_view::MapHelper::worldToMapCoordinates ( const SimpleVector3 position,
int32_t &  x,
int32_t &  y 
)
inline

Definition at line 363 of file MapHelper.hpp.

void next_best_view::MapHelper::worldToMapCoordinates ( const SimpleVector3 position,
SimpleVector3 result 
)
inline

Definition at line 372 of file MapHelper.hpp.

void next_best_view::MapHelper::worldToMapSize ( const double &  size,
double &  result 
)
inline

Definition at line 395 of file MapHelper.hpp.

Member Data Documentation

int8_t next_best_view::MapHelper::mCollisionThreshold
private

Definition at line 70 of file MapHelper.hpp.

costmap_2d::Costmap2D next_best_view::MapHelper::mCostmap
private

Definition at line 74 of file MapHelper.hpp.

int8_t next_best_view::MapHelper::mCostTranslationTable[256]
private

Definition at line 77 of file MapHelper.hpp.

DebugHelperPtr next_best_view::MapHelper::mDebugHelperPtr
private

Definition at line 67 of file MapHelper.hpp.

ros::ServiceClient next_best_view::MapHelper::mGetPlanServiceClient
private

Definition at line 72 of file MapHelper.hpp.

ros::NodeHandle next_best_view::MapHelper::mGlobalNodeHandle
private

Definition at line 71 of file MapHelper.hpp.

nav_msgs::OccupancyGrid next_best_view::MapHelper::mMap
private

Definition at line 73 of file MapHelper.hpp.

bool next_best_view::MapHelper::mMapReceived
private

Definition at line 69 of file MapHelper.hpp.

nav_msgs::OccupancyGrid next_best_view::MapHelper::mRaytracingMap
private

Definition at line 75 of file MapHelper.hpp.


The documentation for this class was generated from the following file:


asr_next_best_view
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 Thu Jan 9 2020 07:20:18