►Cg2o::AbstractHyperGraphElementCreator | Abstract interface for allocating HyperGraphElement |
Cg2o::HyperGraphElementCreator< T > | Templatized creator class which creates graph elements |
Cg2o::AbstractOptimizationAlgorithmCreator | Base for allocating an optimization algorithm |
►Cg2o::AbstractRobustKernelCreator | Abstract interface for allocating a robust kernel |
Cg2o::RobustKernelCreator< T > | Templatized creator class which creates graph elements |
Cg2o::EstimatePropagator::AdjacencyMapEntry | Data structure for loopuk during Dijkstra |
Cg2o::HyperDijkstra::AdjacencyMapEntry | |
►Cg2o::BaseProperty | |
Cg2o::Property< T > | |
Cg2o::Property< bool > | |
Cg2o::Property< double > | |
Cg2o::Property< int > | |
Cmoodycamel::ReaderWriterQueue< T, MAX_BLOCK_SIZE >::Block | |
Cmoodycamel::BlockingReaderWriterQueue< T, MAX_BLOCK_SIZE > | |
Cg2o::BlockSolverTraits< _PoseDim, _LandmarkDim > | Traits to summarize the properties of the fixed size optimization problem |
Cg2o::BlockSolverTraits< Eigen::Dynamic, Eigen::Dynamic > | Traits to summarize the properties of the dynamic size optimization problem |
Cg2o::Cache::CacheKey | |
Cg2o::ColSort | |
CORB_SLAM2::Converter | |
►Cg2o::HyperDijkstra::CostFunction | |
Cg2o::UniformCostFunction | |
Cg2o::Factory::CreatorInformation | |
CNS_DataCache::DataCache< T > | |
CNS_DataCache::DataCache< cv::Mat > | |
CNS_DataCache::DataCache< PointCloud > | |
CNS_DataCache::DataCache< System::PointCloud > | |
CDataTransMsg | |
Cg2o::OptimizableGraph::EdgeIDCompare | Order edges based on the internal ID, which is assigned to the edge in addEdge() |
Cg2o::EstimatePropagator | Propagation of an initial guess |
►Cg2o::EstimatePropagatorCost | Cost for traversing along active edges in the optimizer |
Cg2o::EstimatePropagatorCostOdometry | Cost for traversing only odometry edges |
CORB_SLAM2::ExtractorNode | |
Cg2o::Factory | Create vertices and edges based on TAGs in, for example, a file |
►CDBoW2::FClass | Generic class to encapsulate functions to manage descriptors |
CDBoW2::FORB | Functions to manipulate ORB descriptors |
Cg2o::ForceLinker | |
CORB_SLAM2::Frame | |
CORB_SLAM2::FrameDrawer | |
Cg2o::G2OBatchStatistics | Statistics about the optimization |
CDBoW2::GeneralScoring | Base class of scoring functions |
Cg2o::BaseMultiEdge< D, E >::HessianHelper | Helper for mapping the Hessian memory of the upper triangular block |
Cg2o::HyperDijkstra | |
►Cg2o::HyperGraph | |
►Cg2o::OptimizableGraph | |
Cg2o::SparseOptimizer | |
Cg2o::HyperGraphAction | Abstract action that operates on an entire graph |
Cg2o::HyperGraphActionLibrary | Library of actions, indexed by the action name; |
►Cg2o::HyperGraph::HyperGraphElement | |
Cg2o::Cache | |
►Cg2o::HyperGraph::Edge | |
►Cg2o::OptimizableGraph::Edge | |
►Cg2o::BaseEdge< D, Sim3 > | |
►Cg2o::BaseBinaryEdge< 7, Sim3, VertexSim3Expmap, VertexSim3Expmap > | |
Cg2o::EdgeSim3 | 7D edge between two Vertex7 |
►Cg2o::BaseEdge< D, Vector2d > | |
►Cg2o::BaseBinaryEdge< 2, Vector2d, VertexSBAPointXYZ, VertexSE3Expmap > | |
Cg2o::EdgeSE3ProjectXYZ | |
►Cg2o::BaseBinaryEdge< 2, Vector2d, VertexSBAPointXYZ, VertexSim3Expmap > | |
Cg2o::EdgeInverseSim3ProjectXYZ | |
Cg2o::EdgeSim3ProjectXYZ | |
►Cg2o::BaseUnaryEdge< 2, Vector2d, VertexSE3Expmap > | |
Cg2o::EdgeSE3ProjectXYZOnlyPose | |
►Cg2o::BaseEdge< D, Vector3d > | |
►Cg2o::BaseBinaryEdge< 3, Vector3d, VertexSBAPointXYZ, VertexSE3Expmap > | |
Cg2o::EdgeStereoSE3ProjectXYZ | |
►Cg2o::BaseUnaryEdge< 3, Vector3d, VertexSE3Expmap > | |
Cg2o::EdgeStereoSE3ProjectXYZOnlyPose | |
►Cg2o::BaseEdge< D, E > | |
Cg2o::BaseBinaryEdge< D, E, VertexXi, VertexXj > | |
Cg2o::BaseMultiEdge< D, E > | Base class to represent an edge connecting an arbitrary number of nodes |
Cg2o::BaseUnaryEdge< D, E, VertexXi > | |
►Cg2o::HyperGraph::Vertex | Abstract Vertex, your types must derive from that one |
►Cg2o::OptimizableGraph::Vertex | A general case Vertex for optimization |
►Cg2o::BaseVertex< 3, Vector3d > | |
Cg2o::VertexSBAPointXYZ | Point vertex, XYZ |
►Cg2o::BaseVertex< 6, SE3Quat > | |
Cg2o::VertexSE3Expmap | SE3 Vertex parameterized internally with a transformation matrix and externally with its exponential map |
►Cg2o::BaseVertex< 7, Sim3 > | |
Cg2o::VertexSim3Expmap | Sim3 Vertex, (x,y,z,qw,qx,qy,qz) the parameterization for the increments constructed is a 7d vector (x,y,z,qx,qy,qz) (note that we leave out the w part of the quaternion |
Cg2o::BaseVertex< D, T > | Templatized BaseVertex |
Cg2o::OptimizableGraph::Data | Data packet for a vertex. Extend this class to store in the vertices the potential additional information you need (e.g. images, laser scans, ...) |
Cg2o::Parameter | |
►Cg2o::HyperGraphElementAction | Abstract action that operates on a graph entity |
Cg2o::DrawAction | Draw actions |
Cg2o::HyperGraphElementActionCollection | Collection of actions |
Cg2o::WriteGnuplotAction | |
CImageGrabber | |
CORB_SLAM2::Initializer | |
CInitMsg | |
Cg2o::JacobianWorkspace | Provide memory workspace for computing the Jacobians |
CORB_SLAM2::KeyFrame | |
CORB_SLAM2::KeyFrameDatabase | |
Cmoodycamel::spsc_sema::LightweightSemaphore | |
►Cg2o::LinearSolver< MatrixType > | Basic solver for Ax = b |
Cg2o::LinearSolverCCS< MatrixType > | Solver with faster iterating structure for the linear matrix |
Cg2o::LinearSolverDense< MatrixType > | Linear solver using dense cholesky decomposition |
Cg2o::LinearSolverEigen< MatrixType > | Linear solver which uses the sparse Cholesky solver from Eigen |
Cg2o::LinearSolver< PoseMatrixType > | |
CORB_SLAM2::LocalMapping | |
CORB_SLAM2::LoopClosing | |
CORB_SLAM2::Map | |
►Cmap | |
CDBoW2::BowVector | Vector of words to represent images |
CDBoW2::FeatureVector | Vector of nodes with indexes of local features |
Cg2o::CacheContainer | |
Cg2o::ParameterContainer | Map id to parameters |
►Cg2o::PropertyMap | Collection of properties mapping from name to the property itself |
Cg2o::DrawAction::Parameters | |
CORB_SLAM2::MapDrawer | |
CORB_SLAM2::MapPoint | |
Cg2o::MarginalCovarianceCholesky | Computing the marginal covariance given a cholesky factor (lower triangle of the factor) |
Cg2o::MatrixElem | |
Cg2o::MatrixStructure | Representing the structure of a matrix in column compressed structure (only the upper triangular part of the matrix) |
►Cmultimap | |
Cg2o::EstimatePropagator::PriorityQueue | Priority queue for AdjacencyMapEntry |
CDBoW2::TemplatedVocabulary< TDescriptor, F >::Node | Tree node |
Cg2o::OpenMPMutex | |
►Cg2o::OptimizationAlgorithm | Generic interface for a non-linear solver operating on a graph |
►Cg2o::OptimizationAlgorithmWithHessian | Base for solvers operating on the approximated Hessian, e.g., Gauss-Newton, Levenberg |
Cg2o::OptimizationAlgorithmDogleg | Implementation of Powell's Dogleg Algorithm |
Cg2o::OptimizationAlgorithmGaussNewton | Implementation of the Gauss Newton Algorithm |
Cg2o::OptimizationAlgorithmLevenberg | Implementation of the Levenberg Algorithm |
Cg2o::OptimizationAlgorithmFactory | Create solvers based on their short name |
Cg2o::OptimizationAlgorithmProperty | Describe the properties of a solver |
CORB_SLAM2::Optimizer | |
CORB_SLAM2::ORBextractor | |
CORB_SLAM2::ORBmatcher | |
►Cg2o::HyperGraphElementAction::Parameters | |
Cg2o::DrawAction::Parameters | |
Cg2o::WriteGnuplotAction::Parameters | |
►Cg2o::HyperGraphAction::Parameters | |
Cg2o::HyperGraphAction::ParametersIteration | |
CORB_SLAM2::PnPsolver | |
CPointCloudMapping | |
CPointCloudPublisher | |
Cg2o::EstimatePropagator::PropagateAction | Applying the action for propagating |
CDUtils::Random | Functions to generate pseudo-random numbers |
Cmoodycamel::ReaderWriterQueue< T, MAX_BLOCK_SIZE > | |
Cmoodycamel::ReaderWriterQueue< T, MAX_BLOCK_SIZE >::ReentrantGuard | |
Cg2o::RegisterActionProxy< T > | |
Cg2o::RegisterOptimizationAlgorithmProxy | |
Cg2o::RegisterRobustKernelProxy< T > | |
Cg2o::RegisterTypeProxy< T > | |
►Cg2o::RobustKernel | Base for all robust cost functions |
Cg2o::RobustKernelCauchy | Cauchy cost function |
Cg2o::RobustKernelDCS | Dynamic covariance scaling - DCS |
Cg2o::RobustKernelHuber | Huber Cost Function |
Cg2o::RobustKernelPseudoHuber | Pseudo Huber Cost Function |
Cg2o::RobustKernelSaturated | Saturated cost function |
Cg2o::RobustKernelScaleDelta | Scale a robust kernel to another delta (window size) |
Cg2o::RobustKernelTukey | Tukey Cost Function |
Cg2o::RobustKernelFactory | Create robust kernels based on their human readable name |
Cg2o::SparseBlockMatrixCCS< MatrixType >::RowBlock | A block within a column |
Cg2o::ScopedOpenMPMutex | Lock a mutex within a scope |
Cg2o::ScopeTime | Class to measure the time spent in a scope |
Cg2o::SE3Quat | |
Cg2o::Sim3 | |
CORB_SLAM2::Sim3Solver | |
►CSimplicialLDLT | |
Cg2o::LinearSolverEigen< MatrixType >::CholeskyDecomposition | Sub-classing Eigen's SimplicialLDLT to perform ordering with a given ordering |
►Cg2o::Solver | Generic interface for a sparse solver operating on a graph which solves one iteration of the linearized objective function |
►Cg2o::BlockSolverBase | Base for the block solvers with some basic function interfaces |
Cg2o::BlockSolver< Traits > | Implementation of a solver operating on the blocks of the Hessian |
Cg2o::SparseBlockMatrix< MatrixType > | Sparse matrix which uses blocks |
Cg2o::SparseBlockMatrix< LandmarkMatrixType > | |
Cg2o::SparseBlockMatrix< PoseLandmarkMatrixType > | |
Cg2o::SparseBlockMatrix< PoseMatrixType > | |
Cg2o::SparseBlockMatrixCCS< MatrixType > | Sparse matrix which uses blocks |
Cg2o::SparseBlockMatrixCCS< PoseLandmarkMatrixType > | |
Cg2o::SparseBlockMatrixCCS< PoseMatrixType > | |
Cg2o::SparseBlockMatrixDiagonal< MatrixType > | Sparse matrix which uses blocks on the diagonal |
Cg2o::SparseBlockMatrixDiagonal< LandmarkMatrixType > | |
Cg2o::SparseBlockMatrixHashMap< MatrixType > | Sparse matrix which uses blocks based on hash structures |
CORB_SLAM2::System | |
CDBoW2::TemplatedVocabulary< TDescriptor, F > | Generic Vocabulary |
CDUtils::Timestamp | Timestamp |
CORB_SLAM2::Tracking | |
Cg2o::HyperDijkstra::TreeAction | |
CDUtils::Random::UnrepeatedRandomizer | Provides pseudo-random numbers with no repetitions |
Cg2o::OptimizableGraph::VertexIDCompare | Order vertices based on their ID |
Cg2o::EstimatePropagator::VertexIDHashFunction | Hash function for a vertex |
CORB_SLAM2::Viewer | |
Cmoodycamel::weak_atomic< T > | |
Cmoodycamel::weak_atomic< moodycamel::ReaderWriterQueue::Block * > | |
Cmoodycamel::weak_atomic< size_t > | |
Cmoodycamel::weak_atomic< ssize_t > | |