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