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

Namespaces

 bicubic
 
 bicubic_conv
 
 internal
 

Classes

class  BufferNormalizerFilter
 
class  BufferRegion
 
class  CircleIterator
 
struct  Clamp
 
union  Color
 
class  ColorBlendingFilter
 
class  ColorFillFilter
 
class  ColorMapFilter
 
class  CurvatureFilter
 
class  DeletionFilter
 
class  DuplicationFilter
 
class  EllipseIterator
 
class  GridMap
 
class  GridMapCvConverter
 
class  GridMapCvProcessing
 
class  GridMapIterator
 
class  GridMapRosConverter
 
class  InpaintFilter
 
class  LightIntensityFilter
 
class  LineIterator
 
class  MathExpressionFilter
 
class  MeanInRadiusFilter
 
class  MedianFillFilter
 
class  MinInRadiusFilter
 
class  MockFilter
 
class  NormalColorMapFilter
 
class  NormalVectorsFilter
 
class  Polygon
 
class  PolygonIterator
 
class  PolygonRosConverter
 
class  SetBasicLayersFilter
 
class  SlidingWindowIterator
 
class  SlidingWindowMathExpressionFilter
 
class  SpiralIterator
 
class  SubmapGeometry
 
class  SubmapIterator
 
class  ThresholdFilter
 

Typedefs

typedef Matrix::Scalar DataType
 
typedef Matrix::Scalar DataType
 
typedef Matrix::Scalar DataType
 
typedef Matrix::Scalar DataType
 
typedef Eigen::Matrix4d FunctionValueMatrix
 
typedef Eigen::Matrix4d FunctionValueMatrix
 
typedef Eigen::Matrix4d FunctionValueMatrix
 
typedef Eigen::Matrix4d FunctionValueMatrix
 
typedef Eigen::Array2i Index
 
typedef Eigen::Array2i Index
 
typedef Eigen::Array2i Index
 
typedef Eigen::Array2i Index
 
typedef Eigen::Array2d Length
 
typedef Eigen::Array2d Length
 
typedef Eigen::Array2d Length
 
typedef Eigen::Array2d Length
 
typedef Eigen::MatrixXf Matrix
 
typedef Eigen::MatrixXf Matrix
 
typedef Eigen::MatrixXf Matrix
 
typedef Eigen::MatrixXf Matrix
 
typedef Eigen::Vector2d Position
 
typedef Eigen::Vector2d Position
 
typedef Eigen::Vector2d Position
 
typedef Eigen::Vector2d Position
 
typedef Eigen::Vector3d Position3
 
typedef Eigen::Vector3d Position3
 
typedef Eigen::Vector3d Position3
 
typedef Eigen::Vector3d Position3
 
typedef Eigen::Array2i Size
 
typedef Eigen::Array2i Size
 
typedef Eigen::Array2i Size
 
typedef Eigen::Array2i Size
 
typedef uint64_t Time
 
typedef uint64_t Time
 
typedef uint64_t Time
 
typedef uint64_t Time
 
typedef Eigen::Vector2d Vector
 
typedef Eigen::Vector2d Vector
 
typedef Eigen::Vector2d Vector
 
typedef Eigen::Vector2d Vector
 
typedef Eigen::Vector3d Vector3
 
typedef Eigen::Vector3d Vector3
 
typedef Eigen::Vector3d Vector3
 
typedef Eigen::Vector3d Vector3
 

Enumerations

enum  InterpolationMethods { InterpolationMethods::INTER_NEAREST, InterpolationMethods::INTER_LINEAR, InterpolationMethods::INTER_CUBIC_CONVOLUTION, InterpolationMethods::INTER_CUBIC }
 
enum  InterpolationMethods { InterpolationMethods::INTER_NEAREST, InterpolationMethods::INTER_LINEAR, InterpolationMethods::INTER_CUBIC_CONVOLUTION, InterpolationMethods::INTER_CUBIC }
 
enum  InterpolationMethods { InterpolationMethods::INTER_NEAREST, InterpolationMethods::INTER_LINEAR, InterpolationMethods::INTER_CUBIC_CONVOLUTION, InterpolationMethods::INTER_CUBIC }
 
enum  InterpolationMethods { InterpolationMethods::INTER_NEAREST, InterpolationMethods::INTER_LINEAR, InterpolationMethods::INTER_CUBIC_CONVOLUTION, InterpolationMethods::INTER_CUBIC }
 
enum  StorageIndices { StorageIndices::Column, StorageIndices::Row }
 

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())
 
unsigned int getCols (const MultiArrayMessageType_ &message)
 
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)
 
unsigned int getRows (const MultiArrayMessageType_ &message)
 
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())
 
bool isRowMajor (const MultiArrayMessageType_ &message)
 
bool matrixEigenCopyToMultiArrayMessage (const EigenType_ &e, MultiArrayMessageType_ &m)
 
bool multiArrayMessageCopyToMatrixEigen (const MultiArrayMessageType_ &m, EigenType_ &e)
 
bool multiArrayMessageMapToMatrixEigen (MultiArrayMessageType_ &m, EigenType_ &e)
 
int nDimensions ()
 
Eigen::Matrix< double, N, N > randomCovariance ()
 
Eigen::MatrixXd randomCovarianceXd (int N)
 
void wrapIndexToRange (int &index, int bufferSize)
 
void wrapIndexToRange (Index &index, const Size &bufferSize)
 

Variables

 INTER_CUBIC
 
 INTER_CUBIC_CONVOLUTION
 
 INTER_LINEAR
 
 INTER_NEAREST
 
std::map< StorageIndices, std::string > storageIndexNames
 


grid_map_filters
Author(s): Péter Fankhauser , Martin Wermelinger
autogenerated on Tue Jun 1 2021 02:13:38