Namespaces | Classes | Typedefs | Enumerations | Functions
grid_map Namespace Reference

Namespaces

 bicubic
 
 bicubic_conv
 
 internal
 

Classes

class  BufferRegion
 
class  CircleIterator
 
struct  Clamp
 
union  Color
 
class  Costmap2DConverter
 Convert Costmap2DRos objects into cost or grid maps. More...
 
class  Costmap2DDefaultTranslationTable
 
class  Costmap2DDefaultTranslationTable< float >
 
class  Costmap2DTranslationTable
 
class  EllipseIterator
 
class  GridMap
 
class  GridMapIterator
 
class  LineIterator
 
class  Polygon
 
class  PolygonIterator
 
class  SlidingWindowIterator
 
class  SpiralIterator
 
class  SubmapGeometry
 
class  SubmapIterator
 

Typedefs

using Costmap2DCenturyTranslationTable = Costmap2DTranslationTable<-1, 100, 99, costmap_2d::FREE_SPACE >
 Century cost translations to [0, 100] for costmap_2d -> grid map. This maps the cost onto float fields between 0.0 and 100.0 with reserved values allocated for the costmap_2d. More...
 
using Costmap2DDirectTranslationTable = Costmap2DTranslationTable< costmap_2d::NO_INFORMATION, costmap_2d::LETHAL_OBSTACLE, costmap_2d::INSCRIBED_INFLATED_OBSTACLE, costmap_2d::FREE_SPACE >
 Direct cost translations. This maps the cost directly, simply casting between the underlying unsigned char and float fields. More...
 
typedef Matrix::Scalar DataType
 
typedef Eigen::Matrix4d FunctionValueMatrix
 
typedef Eigen::Array2i Index
 
typedef Eigen::Array2d Length
 
typedef Eigen::MatrixXf Matrix
 
typedef Eigen::Vector2d Position
 
typedef Eigen::Vector3d Position3
 
typedef Eigen::Array2i Size
 
typedef uint64_t Time
 
typedef Eigen::Vector2d Vector
 
typedef Eigen::Vector3d Vector3
 

Enumerations

enum  InterpolationMethods { InterpolationMethods::INTER_NEAREST, InterpolationMethods::INTER_LINEAR, InterpolationMethods::INTER_CUBIC_CONVOLUTION, InterpolationMethods::INTER_CUBIC }
 

Functions

void assertEqual (const M1 &A, const M2 &B, std::string const &message="")
 
void assertFinite (const M1 &A, std::string const &message="")
 
void assertNear (const M1 &A, const M2 &B, T tolerance, std::string const &message="")
 
unsigned int bindIndexToRange (int idReq, unsigned int nElem)
 
void boundIndexToRange (Index &index, const Size &bufferSize)
 
void boundIndexToRange (int &index, const int &bufferSize)
 
void boundPositionToRange (Position &position, const Length &mapLength, const Position &mapPosition)
 
bool checkIfIndexInRange (const Index &index, const Size &bufferSize)
 
bool checkIfPositionWithinMap (const Position &position, const Length &mapLength, const Position &mapPosition)
 
bool colorValueToVector (const unsigned long &colorValue, Eigen::Vector3i &colorVector)
 
bool colorValueToVector (const unsigned long &colorValue, Eigen::Vector3f &colorVector)
 
bool colorValueToVector (const float &colorValue, Eigen::Vector3f &colorVector)
 
bool colorVectorToValue (const Eigen::Vector3i &colorVector, unsigned long &colorValue)
 
void colorVectorToValue (const Eigen::Vector3i &colorVector, float &colorValue)
 
void colorVectorToValue (const Eigen::Vector3f &colorVector, float &colorValue)
 
bool compareRelative (double a, double b, double percentTolerance, double *percentError=NULL)
 
void expectNear (const M1 &A, const M2 &B, T tolerance, std::string const &message="")
 
Index getBufferIndexFromIndex (const Index &index, const Size &bufferSize, const Index &bufferStartIndex)
 
const Eigen::Matrix2i getBufferOrderToMapFrameAlignment ()
 
bool getBufferRegionsForSubmap (std::vector< BufferRegion > &submapBufferRegions, const Index &submapIndex, const Size &submapBufferSize, const Size &bufferSize, const Index &bufferStartIndex=Index::Zero())
 
Index getIndexFromBufferIndex (const Index &bufferIndex, const Size &bufferSize, const Index &bufferStartIndex)
 
Index getIndexFromLinearIndex (const size_t linearIndex, const Size &bufferSize, const bool rowMajor=false)
 
bool getIndexFromPosition (Index &index, const Position &position, const Length &mapLength, const Position &mapPosition, const double &resolution, const Size &bufferSize, const Index &bufferStartIndex=Index::Zero())
 
bool getIndexShiftFromPositionShift (Index &indexShift, const Vector &positionShift, const double &resolution)
 
double getLayerValue (const Matrix &layerMat, int rowReq, int colReq)
 
size_t getLinearIndexFromIndex (const Index &index, const Size &bufferSize, const bool rowMajor=false)
 
bool getPositionFromIndex (Position &position, const Index &index, const Length &mapLength, const Position &mapPosition, const double &resolution, const Size &bufferSize, const Index &bufferStartIndex=Index::Zero())
 
void getPositionOfDataStructureOrigin (const Position &position, const Length &mapLength, Position &positionOfOrigin)
 
bool getPositionShiftFromIndexShift (Vector &positionShift, const Index &indexShift, const double &resolution)
 
bool getSubmapInformation (Index &submapTopLeftIndex, Size &submapBufferSize, Position &submapPosition, Length &submapLength, Index &requestedIndexInSubmap, const Position &requestedSubmapPosition, const Length &requestedSubmapLength, const Length &mapLength, const Position &mapPosition, const double &resolution, const Size &bufferSize, const Index &bufferStartIndex=Index::Zero())
 
Size getSubmapSizeFromCornerIndeces (const Index &topLeftIndex, const Index &bottomRightIndex, const Size &bufferSize, const Index &bufferStartIndex)
 
bool incrementIndex (Index &index, const Size &bufferSize, const Index &bufferStartIndex=Index::Zero())
 
bool incrementIndexForSubmap (Index &submapIndex, Index &index, const Index &submapTopLeftIndex, const Size &submapBufferSize, const Size &bufferSize, const Index &bufferStartIndex=Index::Zero())
 
Eigen::Matrix< double, N, N > randomCovariance ()
 
Eigen::MatrixXd randomCovarianceXd (int N)
 
void wrapIndexToRange (Index &index, const Size &bufferSize)
 
void wrapIndexToRange (int &index, int bufferSize)
 

Typedef Documentation

Century cost translations to [0, 100] for costmap_2d -> grid map. This maps the cost onto float fields between 0.0 and 100.0 with reserved values allocated for the costmap_2d.

Definition at line 136 of file Costmap2DConverter.hpp.

Direct cost translations. This maps the cost directly, simply casting between the underlying unsigned char and float fields.

Definition at line 130 of file Costmap2DConverter.hpp.



grid_map_costmap_2d
Author(s): Péter Fankhauser
autogenerated on Tue Jun 1 2021 02:13:31