►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::CholmodSolverCreator | |
Cg2o::CSparseSolverCreator | |
Cg2o::DenseSolverCreator | |
Cg2o::EigenSolverCreator | |
Cg2o::PCGSolverCreator | |
Cg2o::SLAM2DLinearSolverCreator | |
Cg2o::StructureOnlyCreator | |
►Cg2o::AbstractRobustKernelCreator | Abstract interface for allocating a robust kernel |
Cg2o::RobustKernelCreator< T > | Templatized creator class which creates graph elements |
►CSlamParser::AbstractSlamInterface | Interface for communicating with the SLAM algorithm |
CExampleSlamInterface | Example for an interface to a SLAM algorithm |
Cg2o::G2oSlamInterface | |
Cg2o::HyperDijkstra::AdjacencyMapEntry | |
Cg2o::EstimatePropagator::AdjacencyMapEntry | Data structure for loopuk during Dijkstra |
►CBaseMainWindow | |
CMainWindow | Main window of the g2o viewer |
CMainWindow | Main window of the g2o viewer |
►CBasePropertiesWidget | |
►CPropertiesWidget | |
CViewerPropertiesWidget | |
►Cg2o::BaseProperty | |
Cg2o::Property< T > | |
Cg2o::Property< bool > | |
Cg2o::Property< double > | |
Cg2o::Property< int > | |
►Cg2o::BaseRobot | |
Cg2o::Robot< RobotPoseObject > | |
►Cg2o::BaseSensor | |
►Cg2o::BinarySensor< R, E, O > | |
Cg2o::SensorOdometry< R, E, O > | |
►Cg2o::BinarySensor< Robot2D, EdgeSE2, WorldObjectSE2 > | |
Cg2o::SensorOdometry2D | |
Cg2o::SensorPose2D | |
►Cg2o::BinarySensor< Robot2D, EdgeSE2PointXY, WorldObjectPointXY > | |
Cg2o::SensorPointXY | |
►Cg2o::BinarySensor< Robot2D, EdgeSE2PointXYBearing, WorldObjectPointXY > | |
Cg2o::SensorPointXYBearing | |
►Cg2o::BinarySensor< Robot2D, EdgeSE2PointXYOffset, WorldObjectPointXY > | |
Cg2o::SensorPointXYOffset | |
►Cg2o::BinarySensor< Robot2D, EdgeSE2Segment2D, WorldObjectSegment2D > | |
Cg2o::SensorSegment2D | |
►Cg2o::BinarySensor< Robot2D, EdgeSE2Segment2DLine, WorldObjectSegment2D > | |
Cg2o::SensorSegment2DLine | |
►Cg2o::BinarySensor< Robot2D, EdgeSE2Segment2DPointLine, WorldObjectSegment2D > | |
Cg2o::SensorSegment2DPointLine | |
►Cg2o::BinarySensor< Robot3D, EdgeSE3, WorldObjectSE3 > | |
Cg2o::SensorOdometry3D | |
Cg2o::SensorPose3D | |
►Cg2o::BinarySensor< Robot3D, EdgeSE3Line WorldObjectLine3D > | |
Cg2o::SensorPointLine3D | |
►Cg2o::BinarySensor< Robot3D, EdgeSE3Offset, WorldObjectSE3 > | |
Cg2o::SensorPose3DOffset | |
►Cg2o::BinarySensor< Robot3D, EdgeSE3PointXYZ, WorldObjectTrackXYZ > | |
Cg2o::SensorPointXYZ | |
►Cg2o::BinarySensor< Robot3D, EdgeSE3PointXYZDepth, WorldObjectTrackXYZ > | |
Cg2o::SensorPointXYZDepth | |
►Cg2o::BinarySensor< Robot3D, EdgeSE3PointXYZDisparity, WorldObjectTrackXYZ > | |
Cg2o::SensorPointXYZDisparity | |
Cg2o::BinarySensor< RobotType_, EdgeType_, WorldObjectType_ > | |
Cg2o::UnarySensor< RobotType_, EdgeType_ > | |
►Cg2o::UnarySensor< Robot3D, EdgeSE3Prior > | |
Cg2o::SensorSE3Prior | |
►Cg2o::BaseWorldObject | |
Cg2o::WorldObject< VertexType_ > | |
►Cbasic_streambuf | |
CStreamRedirect | Redirect a stream to a QPlainTextEdit |
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 | |
►Ccholmod_sparse | |
Cg2o::CholmodExt | Our extension of the CHOLMOD matrix struct |
Cg2o::ClosedFormCalibration | Simultaneous calibration of the laser offest and the parameters of a differential drive |
Cg2o::CmpPairFirst< T1, T2, Pred > | |
Cg2o::ColSort | |
Cg2o::CommandArgs | Command line parsing of argc and argv |
Cg2o::CommandArgs::CommandArgument | |
►CSlamParser::CommandNode | |
CSlamParser::AddEdge | |
CSlamParser::AddNode | |
CSlamParser::FixNode | |
CSlamParser::QueryState | |
CSlamParser::SolveSate | |
►Cg2o::HyperDijkstra::CostFunction | |
Cg2o::EdgeTypesCostFunction | |
Cg2o::UniformCostFunction | |
CInvChi2CostFunction | |
Cg2o::Factory::CreatorInformation | |
►Ccs | |
Cg2o::CSparseExt | Our C++ version of the csparse struct |
►Cg2o::HyperGraph::DataContainer | Container class that implements an interface for adding/removing Data elements in a linked list |
►Cg2o::OptimizableGraph::Edge | |
►Cg2o::BaseEdge< D, double > | |
►Cg2o::BaseBinaryEdge< 1, double, VertexCam, VertexCam > | |
Cg2o::EdgeSBAScale | Edge between two SBAcam that specifies the distance between them |
►Cg2o::BaseBinaryEdge< 1, double, VertexLine2D, VertexPointXY > | |
Cg2o::EdgeLine2DPointXY | |
►Cg2o::BaseBinaryEdge< 1, double, VertexSE2, VertexPointXY > | |
Cg2o::EdgeSE2PointXYBearing | |
►Cg2o::BaseEdge< D, EdgeGICP > | |
►Cg2o::BaseBinaryEdge< 3, EdgeGICP, VertexSE3, VertexSE3 > | |
Cg2o::Edge_V_V_GICP | |
►Cg2o::BaseEdge< D, Eigen::Vector2d > | |
►Cg2o::BaseBinaryEdge< 2, Eigen::Vector2d, VertexSE2, VertexPointXY > | |
Cg2o::tutorial::EdgeSE2PointXY | |
►Cg2o::BaseUnaryEdge< 1, Eigen::Vector2d, VertexCircle > | |
CEdgePointOnCircle | Measurement for a point on the circle |
►Cg2o::BaseUnaryEdge< 1, Eigen::Vector2d, VertexParams > | |
CEdgePointOnCurve | Measurement for a point on the curve |
►Cg2o::BaseEdge< D, Eigen::Vector3d > | |
►Cg2o::BaseBinaryEdge< 3, Eigen::Vector3d, VertexSE3, VertexPointXYZ > | |
Cg2o::deprecated::EdgeSE3PointXYZ | |
Cg2o::deprecated::EdgeSE3PointXYZDepth | |
Cg2o::deprecated::EdgeSE3PointXYZDisparity | |
►Cg2o::BaseBinaryEdge< 6, Eigen::Vector3d, VertexPositionVelocity3D, VertexPositionVelocity3D > | |
CTargetOdometry3DEdge | |
►Cg2o::BaseUnaryEdge< 3, Eigen::Vector3d, VertexPosition3D > | |
CGPSObservationPosition3DEdge | |
►Cg2o::BaseUnaryEdge< 3, Eigen::Vector3d, VertexPositionVelocity3D > | |
CGPSObservationEdgePositionVelocity3D | |
►Cg2o::BaseEdge< D, Isometry3D > | |
►Cg2o::BaseBinaryEdge< 6, Isometry3D, VertexSE3, VertexSE3 > | |
►Cg2o::EdgeSE3 | Edge between two 3D pose vertices |
Cg2o::EdgeSE3Euler | 3D edge between two VertexSE3, uses the euler angle parameterization for the read/write functions only |
Cg2o::EdgeSE3Offset | Offset edge |
Cg2o::OnlineEdgeSE3 | |
►Cg2o::BaseMultiEdge< 6, Isometry3D > | |
Cg2o::EdgeSE3Calib | Landmark measurement that also calibrates an offset for the landmark measurement |
►Cg2o::BaseUnaryEdge< 6, Isometry3D, VertexSE3 > | |
Cg2o::EdgeSE3Prior | Prior for an SE3 element |
►Cg2o::BaseEdge< D, Line2D > | |
►Cg2o::BaseBinaryEdge< 2, Line2D, VertexLine2D, VertexLine2D > | |
Cg2o::EdgeLine2D | |
►Cg2o::BaseBinaryEdge< 2, Line2D, VertexSE2, VertexLine2D > | |
Cg2o::EdgeSE2Line2D | |
►Cg2o::BaseEdge< D, OdomAndLaserMotion > | |
►Cg2o::BaseBinaryEdge< 3, OdomAndLaserMotion, VertexSE2, VertexBaseline > | |
CEdgeCalib | |
►Cg2o::BaseBinaryEdge< 3, OdomAndLaserMotion, VertexSE2, VertexOdomDifferentialParams > | |
Cg2o::EdgeSE2PureCalib | Calibrate odometry and laser based on a set of measurements |
►Cg2o::BaseEdge< D, Plane3D > | |
►Cg2o::BaseMultiEdge< 3, Plane3D > | |
Cg2o::EdgeSE3PlaneSensorCalib | Plane measurement that also calibrates an offset for the sensor |
►Cg2o::BaseEdge< D, SE2 > | |
►Cg2o::BaseBinaryEdge< 3, SE2, VertexSE2, VertexSE2 > | |
►Cg2o::EdgeSE2 | 2D edge between two Vertex2 |
Cg2o::OnlineEdgeSE2 | |
Cg2o::EdgeSE2Offset | Offset edge |
Cg2o::tutorial::EdgeSE2 | 2D edge between two Vertex2, i.e., the odometry |
►Cg2o::BaseMultiEdge< 3, SE2 > | |
Cg2o::EdgeSE2SensorCalib | Scanmatch measurement that also calibrates an offset for the laser |
►Cg2o::BaseUnaryEdge< 3, SE2, VertexSE2 > | |
Cg2o::EdgeSE2Prior | Prior for a two D pose |
►Cg2o::BaseEdge< D, SE3Quat > | |
►Cg2o::BaseBinaryEdge< 6, SE3Quat, VertexCam, VertexCam > | |
Cg2o::EdgeSBACam | 3D edge between two SBAcam |
►Cg2o::BaseBinaryEdge< 6, SE3Quat, VertexSE3, VertexSE3 > | |
Cg2o::deprecated::EdgeSE3 | 3D edge between two VertexSE3 |
Cg2o::deprecated::EdgeSE3Offset | Offset edge |
►Cg2o::BaseBinaryEdge< 6, SE3Quat, VertexSE3Expmap, VertexSE3Expmap > | |
Cg2o::EdgeSE3Expmap | 6D edge between two Vertex6 |
►Cg2o::BaseUnaryEdge< 6, SE3Quat, VertexSE3 > | |
Cg2o::deprecated::EdgeSE3Prior | |
►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, VertexCameraBAL, VertexPointBAL > | |
CEdgeObservationBAL | Edge representing the observation of a world feature by a camera |
►Cg2o::BaseEdge< D, Vector2D > | |
►Cg2o::BaseBinaryEdge< 2, Vector2D, VertexPointXY, VertexPointXY > | |
Cg2o::EdgePointXY | |
►Cg2o::BaseBinaryEdge< 2, Vector2D, VertexSBAPointXYZ, VertexCam > | |
Cg2o::EdgeProjectP2MC | |
►Cg2o::BaseBinaryEdge< 2, Vector2D, VertexSBAPointXYZ, VertexSE3Expmap > | |
Cg2o::EdgeProjectXYZ2UV | |
►Cg2o::BaseBinaryEdge< 2, Vector2D, VertexSBAPointXYZ, VertexSim3Expmap > | |
Cg2o::EdgeSim3ProjectXYZ | |
►Cg2o::BaseBinaryEdge< 2, Vector2D, VertexSE2, VertexPointXY > | |
Cg2o::EdgeSE2PointXY | |
Cg2o::EdgeSE2PointXYOffset | |
►Cg2o::BaseBinaryEdge< 2, Vector2D, VertexSE2, VertexSegment2D > | |
Cg2o::EdgeSE2Segment2DLine | |
►Cg2o::BaseMultiEdge< 2, Vector2D > | |
Cg2o::EdgeProjectP2MC_Intrinsics | |
Cg2o::EdgeProjectPSI2UV | |
Cg2o::EdgeSE2PointXYCalib | Landmark measurement that also calibrates an offset for the landmark measurement |
►Cg2o::BaseUnaryEdge< 2, Vector2D, VertexSE2 > | |
Cg2o::EdgeSE2XYPrior | Prior for a two D pose with constraints only in xy direction (like gps) |
►Cg2o::BaseEdge< D, Vector3D > | |
►Cg2o::BaseBinaryEdge< 3, Vector3D, VertexPointXYZ, VertexPointXYZ > | |
Cg2o::EdgePointXYZ | |
►Cg2o::BaseBinaryEdge< 3, Vector3D, VertexSBAPointXYZ, VertexCam > | |
Cg2o::EdgeProjectP2SC | |
►Cg2o::BaseBinaryEdge< 3, Vector3D, VertexSBAPointXYZ, VertexSCam > | |
Cg2o::Edge_XYZ_VSC | Point vertex, XYZ, is in types_sba |
►Cg2o::BaseBinaryEdge< 3, Vector3D, VertexSBAPointXYZ, VertexSE3Expmap > | |
Cg2o::EdgeProjectXYZ2UVU | |
►Cg2o::BaseBinaryEdge< 3, Vector3D, VertexSE2, VertexSegment2D > | |
Cg2o::EdgeSE2Segment2DPointLine | |
►Cg2o::BaseBinaryEdge< 3, Vector3D, VertexSE3, VertexPointXYZ > | |
Cg2o::EdgeSE3PointXYZ | G2o edge from a track to a point node |
Cg2o::EdgeSE3PointXYZDepth | |
Cg2o::EdgeSE3PointXYZDisparity | Edge from a track to a depth camera node using a disparity measurement |
►Cg2o::BaseEdge< D, Vector4D > | |
►Cg2o::BaseBinaryEdge< 4, Vector4D, VertexPlane, VertexPlane > | |
Cg2o::EdgePlane | |
►Cg2o::BaseBinaryEdge< 4, Vector4D, VertexSE2, VertexSegment2D > | |
Cg2o::EdgeSE2Segment2D | |
►Cg2o::BaseMultiEdge< 4, Vector4D > | |
Cg2o::EdgeSE2TwoPointsXY | |
►Cg2o::BaseEdge< D, Vector6d > | |
►Cg2o::BaseBinaryEdge< 6, Vector6d, VertexLine3D, VertexLine3D > | |
Cg2o::EdgeLine3D | |
►Cg2o::BaseEdge< D, Vector7d > | |
►Cg2o::BaseBinaryEdge< 7, Vector7d, VertexSE3, VertexLine3D > | |
Cg2o::EdgeSE3Line3D | |
►Cg2o::BaseEdge< D, VectorXD > | |
►Cg2o::BaseMultiEdge<-1, VectorXD > | |
Cg2o::EdgeSE2LotsOfXY | |
Cg2o::EdgeSE3LotsOfXYZ | |
►Cg2o::BaseEdge< D, VelocityMeasurement > | |
►Cg2o::BaseMultiEdge< 3, VelocityMeasurement > | |
Cg2o::EdgeSE2OdomDifferentialCalib | |
►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::BaseEdge<-1, E > | |
Cg2o::BaseMultiEdge<-1, E > | |
►Cg2o::OptimizableGraph::Vertex | A general case Vertex for optimization |
►Cg2o::BaseVertex< 1, double > | |
CVertexBaseline | |
►Cg2o::BaseVertex< 2, Eigen::Vector2d > | |
Cg2o::tutorial::VertexPointXY | |
►Cg2o::BaseVertex< 2, Line2D > | |
Cg2o::VertexLine2D | |
►Cg2o::BaseVertex< 2, Vector2D > | |
Cg2o::VertexPointXY | |
►Cg2o::BaseVertex< 3, Eigen::Vector3d > | |
Cg2o::deprecated::VertexPointXYZ | |
CVertexCircle | Circle located at x,y with radius r |
CVertexParams | Params, a, b, and lambda for a * exp(-lambda * t) + b |
CVertexPointBAL | 3D world feature |
CVertexPosition3D | |
CVertexPosition3D | |
CVertexVelocity3D | |
►Cg2o::BaseVertex< 3, Plane3D > | |
Cg2o::VertexPlane | |
►Cg2o::BaseVertex< 3, SE2 > | |
Cg2o::tutorial::VertexSE2 | 2D pose Vertex, (x,y,theta) |
►Cg2o::VertexSE2 | 2D pose Vertex, (x,y,theta) |
Cg2o::OnlineVertexSE2 | |
►Cg2o::BaseVertex< 3, Vector3D > | |
Cg2o::VertexOdomDifferentialParams | |
Cg2o::VertexPointXYZ | Vertex for a tracked point in space |
Cg2o::VertexSBAPointXYZ | Point vertex, XYZ |
►Cg2o::BaseVertex< 4, Eigen::Matrix< double, 5, 1, Eigen::ColMajor > > | |
Cg2o::VertexIntrinsics | Vertex encoding the intrinsics of the camera fx, fy, cx, xy, baseline; |
►Cg2o::BaseVertex< 4, Vector4D > | |
Cg2o::VertexSegment2D | |
►Cg2o::BaseVertex< 6, Isometry3D > | |
►Cg2o::VertexSE3 | 3D pose Vertex, represented as an Isometry3D |
Cg2o::OnlineVertexSE3 | |
Cg2o::VertexSCam | Stereo camera vertex, derived from SE3 class. Note that we use the actual pose of the vertex as its parameterization, rather than the transform from RW to camera coords. Uses static vars for camera params, so there is a single camera setup |
Cg2o::VertexSE3Euler | 3D pose Vertex, (x,y,z,roll,pitch,yaw) the internal parameterization is the same as veretx_se3_quat. Only the read/write operations are rewritten to input/output euler angles |
►Cg2o::BaseVertex< 6, Line3D > | |
Cg2o::VertexLine3D | |
►Cg2o::BaseVertex< 6, SBACam > | |
Cg2o::VertexCam | SBACam Vertex, (x,y,z,qw,qx,qy,qz) the parameterization for the increments constructed is a 6d vector (x,y,z,qx,qy,qz) (note that we leave out the w part of the quaternion. qw is assumed to be positive, otherwise there is an ambiguity in qx,qy,qz as a rotation |
►Cg2o::BaseVertex< 6, SE3Quat > | |
Cg2o::deprecated::VertexSE3 | 3D pose Vertex, (x,y,z,qw,qx,qy,qz) the parameterization for the increments constructed is a 6d vector (x,y,z,qx,qy,qz) (note that we leave out the w part of the quaternion |
Cg2o::VertexSE3Expmap | SE3 Vertex parameterized internally with a transformation matrix and externally with its exponential map |
►Cg2o::BaseVertex< 6, Vector6d > | |
CVertexPositionVelocity3D | |
►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< 9, Eigen::VectorXd > | |
CVertexCameraBAL | Camera vertex which stores the parameters for a pinhole camera |
Cg2o::BaseVertex< D, T > | Templatized BaseVertex |
Cg2o::DataQueue | Simple queue to store data and retrieve based on a timestamp |
Cg2o::DlWrapper | Loading libraries during run-time |
CSlamParser::Driver | |
Cg2o::EdgeCreator | |
Cg2o::EdgeCreator::EdgeCreatorEntry | |
Cg2o::EdgeGICP | |
Cg2o::OptimizableGraph::EdgeIDCompare | Order edges based on the internal ID, which is assigned to the edge in addEdge() |
CEdgeInformation | Store the information parsed from a g2o file |
Cg2o::EdgeLabeler | |
Cg2o::EdgeNormal | |
CEdgeProjectDepth | G2o edge from a track to a depth camera node using a depth measurement (true distance, not disparity) |
CEdgeProjectDepth | G2o edge from a track to a depth camera node using a depth measurement (true distance, not disparity) |
CEdgeSE2TrackXYZ | G2o edge from a track to a point node |
CEdgeSE3TrackXYZ | G2o edge from a track to a point node |
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 |
Cg2o::Factory | Create vertices and edges based on TAGs in, for example, a file |
►CFlexLexer | |
CyyFlexLexer | |
Cg2o::ForceLinker | |
Cg2o::G2OBatchStatistics | Statistics about the optimization |
Cg2o::GaussianSampler< SampleType, CovarianceType > | |
Cg2o::GaussianSampler< typename EdgeType::ErrorVector, InformationType > | |
Cg2o::opengl::GLUWrapper | Handle the GLU quadratic |
Cg2o::Gm2dlIO | Read / write gm2dl file into / out of a SparseOptimizer |
Cg2o::tutorial::Simulator::GridEdge | Odometry constraint |
Cg2o::tutorial::Simulator::GridPose | |
Cg2o::BaseMultiEdge< D, E >::HessianHelper | Helper for mapping the Hessian memory of the upper triangular block |
Cg2o::BaseMultiEdge<-1, E >::HessianHelper | Helper for mapping the Hessian memory of the upper triangular block |
Cg2o::HyperDijkstra | |
►Cg2o::HyperGraph | |
►Cg2o::OptimizableGraph | |
►Cg2o::SparseOptimizer | |
►Cg2o::SparseOptimizerOnline | |
Cg2o::SparseOptimizerIncremental | |
►Cg2o::HyperGraphAction | Abstract action that operates on an entire graph |
Cg2o::GuiHyperGraphAction | Action which calls an GUI update after each iteration |
Cg2o::SparseOptimizerTerminateAction | Stop iterating based on the gain which is (oldChi - currentChi) / currentChi |
Cg2o::HyperGraphActionLibrary | Library of actions, indexed by the action name; |
►Cg2o::HyperGraph::HyperGraphElement | |
►Cg2o::Cache | |
Cg2o::CacheSE2Offset | Caching the offset related to a vertex |
►Cg2o::CacheSE3Offset | Caching the offset related to a vertex |
Cg2o::CacheCamera | |
►Cg2o::deprecated::CacheSE3Offset | Caching the offset related to a vertex |
Cg2o::deprecated::CacheCamera | |
Cg2o::tutorial::CacheSE2Offset | |
►Cg2o::HyperGraph::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::RobotData | Data recorded by the robot |
►Cg2o::RawLaser | Raw laser measuerement |
Cg2o::RobotLaser | Laser measurement obtained by a robot |
Cg2o::VertexEllipse | String ellipse to be attached to a vertex |
Cg2o::VertexTag | String tag to be attached to a vertex |
►Cg2o::HyperGraph::Edge | |
Cg2o::OptimizableGraph::Edge | |
►Cg2o::HyperGraph::Vertex | Abstract Vertex, your types must derive from that one |
Cg2o::OptimizableGraph::Vertex | A general case Vertex for optimization |
►Cg2o::Parameter | |
Cg2o::CameraParameters | |
►Cg2o::deprecated::ParameterSE3Offset | Offset for an SE3 |
Cg2o::deprecated::ParameterCamera | Parameters for a camera |
Cg2o::ParameterSE2Offset | Offset for an SE2 |
►Cg2o::ParameterSE3Offset | Offset for an SE3 |
►Cg2o::ParameterCamera | Parameters for a camera |
Cg2o::ParameterStereoCamera | Parameters for a camera |
Cg2o::tutorial::ParameterSE2Offset | |
►Cg2o::HyperGraphElementAction | Abstract action that operates on a graph entity |
Cg2o::DrawAction | Draw actions |
Cg2o::HyperGraphElementActionCollection | Collection of actions |
►Cg2o::WriteGnuplotAction | |
Cg2o::deprecated::EdgeSE3WriteGnuplotAction | |
Cg2o::deprecated::VertexPointXYZWriteGnuplotAction | |
Cg2o::deprecated::VertexSE3WriteGnuplotAction | |
Cg2o::EdgeSE2PointXYBearingWriteGnuplotAction | |
Cg2o::EdgeSE2PointXYWriteGnuplotAction | |
Cg2o::EdgeSE2WriteGnuplotAction | |
Cg2o::EdgeSE3WriteGnuplotAction | Output the pose-pose constraint to Gnuplot data file |
Cg2o::VertexPointXYWriteGnuplotAction | |
Cg2o::VertexPointXYZWriteGnuplotAction | |
Cg2o::VertexSE2WriteGnuplotAction | |
Cg2o::VertexSE3WriteGnuplotAction | Write the vertex to some Gnuplot data file |
Cg2o::VertexSegment2DWriteGnuplotAction | |
CIncrementalEdgesCompare | Sort Edges for inserting them sequentially |
Cg2o::JacobianWorkspace | Provide memory workspace for computing the Jacobians |
Cg2o::tutorial::Simulator::Landmark | Simulated landmark |
Cg2o::tutorial::Simulator::LandmarkEdge | |
Cg2o::LaserParameters | Parameters for a 2D range finder |
►Cg2o::LinearSolver< MatrixType > | Basic solver for Ax = b |
►Cg2o::LinearSolverCCS< MatrixType > | Solver with faster iterating structure for the linear matrix |
Cg2o::LinearSolverCholmod< MatrixType > | Basic solver for Ax = b which has to reimplemented for different linear algebra libraries |
Cg2o::LinearSolverCSparse< MatrixType > | Linear solver which uses CSparse |
Cg2o::LinearSolverCholmodOnline< MatrixType > | Linear solver which allows to update the cholesky factor |
Cg2o::LinearSolverDense< MatrixType > | Linear solver using dense cholesky decomposition |
Cg2o::LinearSolverEigen< MatrixType > | Linear solver which uses the sparse Cholesky solver from Eigen |
Cg2o::LinearSolverPCG< MatrixType > | Linear solver using PCG, pre-conditioner is block Jacobi |
Cg2o::LinearSolver< PoseMatrixType > | |
►Cg2o::LinearSolverCholmodOnlineInterface | Generic interface for the online solver |
Cg2o::LinearSolverCholmodOnline< MatrixType > | Linear solver which allows to update the cholesky factor |
CLineInfo | |
CSlamParser::location | Abstract a location |
►Cmap | |
Cg2o::CacheContainer | |
Cg2o::ParameterContainer | Map id to parameters |
►Cg2o::PropertyMap | Collection of properties mapping from name to the property itself |
Cg2o::DrawAction::Parameters | |
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) |
Cg2o::MotionInformation | |
Cg2o::MotionMeasurement | A 2D odometry measurement expressed as a transformation |
►Cmultimap | |
Cg2o::EstimatePropagator::PriorityQueue | Priority queue for AdjacencyMapEntry |
Cg2o::OdomAndLaserMotion | |
Cg2o::OdomConvert | Convert between the different types of odometry measurements |
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::SolverSLAM2DLinear | Implementation of a linear approximation for 2D pose graph SLAM |
Cg2o::OptimizationAlgorithmLevenberg | Implementation of the Levenberg Algorithm |
Cg2o::StructureOnlySolver< PointDoF > | This is a solver for "structure-only" optimization" |
Cg2o::OptimizationAlgorithmFactory | Create solvers based on their short name |
Cg2o::OptimizationAlgorithmProperty | Describe the properties of a solver |
►Cg2o::HyperGraphAction::Parameters | |
Cg2o::HyperGraphAction::ParametersIteration | |
►Cg2o::HyperGraphElementAction::Parameters | |
Cg2o::DrawAction::Parameters | |
Cg2o::WriteGnuplotAction::Parameters | |
CSlamParser::Parser | A Bison parser |
CSlamParser::ParserInterface | Top-level interface to the parser |
Cg2o::Plane3D | |
►Cg2o::PointSensorParameters | |
Cg2o::SensorPointLine3D | |
Cg2o::SensorPointXY | |
Cg2o::SensorPointXYBearing | |
Cg2o::SensorPointXYOffset | |
Cg2o::SensorPointXYZ | |
Cg2o::SensorPointXYZDepth | |
Cg2o::SensorPointXYZDisparity | |
Cg2o::SensorPose2D | |
Cg2o::SensorPose3D | |
Cg2o::SensorPose3DOffset | |
Cg2o::SensorSE3Prior | |
Cg2o::SensorSegment2D | |
Cg2o::SensorSegment2DLine | |
Cg2o::SensorSegment2DPointLine | |
CSlamParser::position | Abstract a position |
CPositionVelocity3DEdge | |
Cg2o::EstimatePropagator::PropagateAction | Applying the action for propagating |
►CQDialog | |
CPropertiesWidget | |
►CQGLViewer | |
Cg2o::G2oQGLViewer | OpenGL based viewer for the graph |
Cg2o::Slam2DViewer | |
►CQMainWindow | |
CMainWindow | Main window of the g2o viewer |
CMainWindow | Main window of the g2o viewer |
►CQThread | |
Cg2o::SleepThread | Helper for calling usleep on any system using Qt |
Cg2o::tutorial::Rand | Generate random numbers |
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::RobustKernelFair | Fair cost function |
Cg2o::RobustKernelGemanMcClure | Geman-McClure cost function |
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::RobustKernelWelsch | Welsch cost function |
Cg2o::RobustKernelFactory | Create robust kernels based on their human readable name |
CRotationMatrix2QuaternionManifold | Functor used to compute the Jacobian via AD |
Cg2o::SparseBlockMatrixCCS< MatrixType >::RowBlock | A block within a column |
Cg2o::RunG2OViewer | Wrapper for running the g2o viewer |
CSample | |
Cg2o::Sampler | |
Cg2o::ScopedArray< T > | Scoped pointer for an array, i.e., array will be deleted on leaving the scope |
Cg2o::ScopedOpenMPMutex | Lock a mutex within a scope |
Cg2o::ScopedPointer< T, Del > | Scoped pointer for an objectarray, i.e., object will be deleted on leaving the scope |
Cg2o::ScopedTictoc | Simplify calls to tictoc() for a whole scope |
Cg2o::ScopeTime | Class to measure the time spent in a scope |
Cg2o::SE2 | Represent SE2 |
Cg2o::tutorial::SE2 | |
►Cg2o::SE3Quat | |
Cg2o::SBACam | |
CSlamParser::Parser::semantic_type | Symbol semantic values |
►CSensor | |
CPlaneSensor | |
Cg2o::SigmaPoint< SampleType > | |
Cg2o::Sim3 | |
►CSimplicialLDLT | |
Cg2o::LinearSolverEigen< MatrixType >::CholeskyDecomposition | Sub-classing Eigen's SimplicialLDLT to perform ordering with a given ordering |
Cg2o::tutorial::Simulator | |
►CSimulatorItem | |
CSimulator | |
►CWorldItem | |
CPlaneItem | |
CRobot | |
►CSlamParser::SlamContext | |
CSlamParser::SlamContextInterface | |
►CSlamFlexLexer | |
CSlamParser::Scanner | |
CSlamParser::slice< T, S > | Present a slice of the top of a stack |
CSolution | |
►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< Eigen::MatrixXd > | |
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 |
Cg2o::csparse_extension::SparseMatrixEntry | |
Cg2o::csparse_extension::SparseMatrixEntryColSort | |
CSlamParser::stack< T, S > | |
CSlamParser::stack< location_type > | |
CSlamParser::stack< semantic_type > | |
CSlamParser::stack< state_type > | |
Cg2o::Star | |
Cg2o::TicTocElement | Internal structure of the tictoc profiling |
Cg2o::TicTocInitializer | Helper for printing the struct at the end of the lifetime of the program |
CSlamParser::Parser::token | Tokens |
►Cg2o::HyperDijkstra::TreeAction | |
Cg2o::BackBoneTreeAction | |
Cg2o::ThetaTreeAction | Compute the initial guess of theta while travelling along the MST |
►CVector2D | |
Cg2o::Line2D | |
►CVector6d | |
Cg2o::Line3D | |
Cg2o::VelocityMeasurement | Velocity measurement of a differential robot |
Cg2o::OptimizableGraph::VertexIDCompare | Order vertices based on their ID |
Cg2o::EstimatePropagator::VertexIDHashFunction | Hash function for a vertex |
►CVertexType_ | |
Cg2o::WorldObject< VertexType_ > | |
Cg2o::World | |
Cyy_buffer_state | |
Cyy_trans_info | |