g2o
|
#include <optimizable_graph.h>
Classes | |
class | Edge |
struct | EdgeIDCompare |
order edges based on the internal ID, which is assigned to the edge in addEdge() More... | |
class | Vertex |
A general case Vertex for optimization. More... | |
struct | VertexIDCompare |
order vertices based on their ID More... | |
Public Types | |
enum | ActionType { AT_PREITERATION, AT_POSTITERATION, AT_NUM_ELEMENTS } |
typedef std::set< HyperGraphAction * > | HyperGraphActionSet |
typedef std::vector< OptimizableGraph::Vertex * > | VertexContainer |
vector container for vertices More... | |
typedef std::vector< OptimizableGraph::Edge * > | EdgeContainer |
vector container for edges More... | |
Public Types inherited from g2o::HyperGraph | |
typedef std::bitset< HyperGraph::HGET_NUM_ELEMS > | GraphElemBitset |
typedef std::set< Edge * > | EdgeSet |
typedef std::set< Vertex * > | VertexSet |
typedef std::unordered_map< int, Vertex * > | VertexIDMap |
typedef std::vector< Vertex * > | VertexContainer |
Public Member Functions | |
Vertex * | vertex (int id) |
returns the vertex number id appropriately casted More... | |
const Vertex * | vertex (int id) const |
returns the vertex number id appropriately casted More... | |
OptimizableGraph () | |
empty constructor More... | |
virtual | ~OptimizableGraph () |
void | addGraph (OptimizableGraph *g) |
adds all edges and vertices of the graph g to this graph. More... | |
virtual bool | addVertex (HyperGraph::Vertex *v, Data *userData) |
virtual bool | addVertex (HyperGraph::Vertex *v) |
virtual bool | addEdge (HyperGraph::Edge *e) |
virtual bool | setEdgeVertex (HyperGraph::Edge *e, int pos, HyperGraph::Vertex *v) |
double | chi2 () const |
returns the chi2 of the current configuration More... | |
int | maxDimension () const |
return the maximum dimension of all vertices in the graph More... | |
std::set< int > | dimensions () const |
virtual int | optimize (int iterations, bool online=false) |
virtual void | preIteration (int) |
called at the beginning of an iteration (argument is the number of the iteration) More... | |
virtual void | postIteration (int) |
called at the end of an iteration (argument is the number of the iteration) More... | |
bool | addPreIterationAction (HyperGraphAction *action) |
add an action to be executed before each iteration More... | |
bool | addPostIterationAction (HyperGraphAction *action) |
add an action to be executed after each iteration More... | |
bool | removePreIterationAction (HyperGraphAction *action) |
remove an action that should no longer be execured before each iteration More... | |
bool | removePostIterationAction (HyperGraphAction *action) |
remove an action that should no longer be execured after each iteration More... | |
virtual void | push () |
push the estimate of all variables onto a stack More... | |
virtual void | pop () |
pop (restore) the estimate of all variables from the stack More... | |
virtual void | discardTop () |
discard the last backup of the estimate for all variables by removing it from the stack More... | |
virtual bool | load (std::istream &is, bool createEdges=true) |
load the graph from a stream. Uses the Factory singleton for creating the vertices and edges. More... | |
bool | load (const char *filename, bool createEdges=true) |
virtual bool | save (std::ostream &os, int level=0) const |
save the graph to a stream. Again uses the Factory system. More... | |
bool | save (const char *filename, int level=0) const |
function provided for convenience, see save() above More... | |
bool | saveSubset (std::ostream &os, HyperGraph::VertexSet &vset, int level=0) |
save a subgraph to a stream. Again uses the Factory system. More... | |
bool | saveSubset (std::ostream &os, HyperGraph::EdgeSet &eset) |
save a subgraph to a stream. Again uses the Factory system. More... | |
virtual void | push (HyperGraph::VertexSet &vset) |
push the estimate of a subset of the variables onto a stack More... | |
virtual void | pop (HyperGraph::VertexSet &vset) |
pop (restore) the estimate a subset of the variables from the stack More... | |
virtual void | discardTop (HyperGraph::VertexSet &vset) |
ignore the latest stored element on the stack, remove it from the stack but do not restore the estimate More... | |
virtual void | setFixed (HyperGraph::VertexSet &vset, bool fixed) |
fixes/releases a set of vertices More... | |
void | setRenamedTypesFromString (const std::string &types) |
bool | isSolverSuitable (const OptimizationAlgorithmProperty &solverProperty, const std::set< int > &vertDims=std::set< int >()) const |
virtual void | clearParameters () |
bool | addParameter (Parameter *p) |
Parameter * | parameter (int id) |
bool | verifyInformationMatrices (bool verbose=false) const |
bool | saveVertex (std::ostream &os, Vertex *v) const |
bool | saveParameter (std::ostream &os, Parameter *v) const |
bool | saveEdge (std::ostream &os, Edge *e) const |
bool | saveUserData (std::ostream &os, HyperGraph::Data *v) const |
JacobianWorkspace & | jacobianWorkspace () |
the workspace for storing the Jacobians of the graph More... | |
const JacobianWorkspace & | jacobianWorkspace () const |
ParameterContainer & | parameters () |
const ParameterContainer & | parameters () const |
Public Member Functions inherited from g2o::HyperGraph | |
HyperGraph () | |
constructs an empty hyper graph More... | |
virtual | ~HyperGraph () |
destroys the hyper-graph and all the vertices of the graph More... | |
Vertex * | vertex (int id) |
returns a vertex id in the hyper-graph, or 0 if the vertex id is not present More... | |
const Vertex * | vertex (int id) const |
returns a vertex id in the hyper-graph, or 0 if the vertex id is not present More... | |
virtual bool | removeVertex (Vertex *v, bool detach=false) |
removes a vertex from the graph. Returns true on success (vertex was present) More... | |
virtual bool | removeEdge (Edge *e) |
removes a vertex from the graph. Returns true on success (edge was present) More... | |
virtual void | clear () |
clears the graph and empties all structures. More... | |
const VertexIDMap & | vertices () const |
VertexIDMap & | vertices () |
const EdgeSet & | edges () const |
EdgeSet & | edges () |
virtual bool | mergeVertices (Vertex *vBig, Vertex *vSmall, bool erase) |
virtual bool | detachVertex (Vertex *v) |
virtual bool | changeId (Vertex *v, int newId) |
Static Public Member Functions | |
static bool | initMultiThreading () |
Public Attributes | |
class G2O_CORE_API | Vertex |
class G2O_CORE_API | Edge |
Public Attributes inherited from g2o::HyperGraph | |
class G2O_CORE_API | Data |
class G2O_CORE_API | DataContainer |
class G2O_CORE_API | Vertex |
class G2O_CORE_API | Edge |
Protected Attributes | |
std::map< std::string, std::string > | _renamedTypesLookup |
long long | _nextEdgeId |
std::vector< HyperGraphActionSet > | _graphActions |
bool | _edge_has_id |
ParameterContainer | _parameters |
JacobianWorkspace | _jacobianWorkspace |
Protected Attributes inherited from g2o::HyperGraph | |
VertexIDMap | _vertices |
EdgeSet | _edges |
Additional Inherited Members | |
Static Public Attributes inherited from g2o::HyperGraph | |
static const int | UnassignedId = -1 |
static const int | InvalidId = -2 |
This is an abstract class that represents one optimization problem. It specializes the general graph to contain special vertices and edges. The vertices represent parameters that can be optimized, while the edges represent constraints. This class also provides basic functionalities to handle the backup/restore of portions of the vertices.
Definition at line 65 of file optimizable_graph.h.
typedef std::vector<OptimizableGraph::Edge*> g2o::OptimizableGraph::EdgeContainer |
vector container for edges
Definition at line 102 of file optimizable_graph.h.
typedef std::set<HyperGraphAction*> g2o::OptimizableGraph::HyperGraphActionSet |
Definition at line 72 of file optimizable_graph.h.
typedef std::vector<OptimizableGraph::Vertex*> g2o::OptimizableGraph::VertexContainer |
vector container for vertices
Definition at line 100 of file optimizable_graph.h.
Enumerator | |
---|---|
AT_PREITERATION | |
AT_POSTITERATION | |
AT_NUM_ELEMENTS |
Definition at line 67 of file optimizable_graph.h.
g2o::OptimizableGraph::OptimizableGraph | ( | ) |
empty constructor
Definition at line 219 of file optimizable_graph.cpp.
References _edge_has_id, _graphActions, _nextEdgeId, and AT_NUM_ELEMENTS.
|
virtual |
Definition at line 225 of file optimizable_graph.cpp.
References g2o::HyperGraph::clear(), and clearParameters().
|
virtual |
adds a new edge. The edge should point to the vertices that it is connecting (setFrom/setTo).
Reimplemented from g2o::HyperGraph.
Definition at line 257 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Edge::_internalId, _jacobianWorkspace, _nextEdgeId, g2o::HyperGraph::addEdge(), g2o::HyperGraph::Edge::numUndefinedVertices(), g2o::OptimizableGraph::Edge::resolveCaches(), g2o::OptimizableGraph::Edge::resolveParameters(), and g2o::JacobianWorkspace::updateSize().
Referenced by g2o::G2oSlamInterface::addEdge(), addGraph(), g2o::addOdometryCalibLinksDifferential(), g2o::assignHierarchicalEdges(), g2o::computeSimpleStars(), main(), g2o::Gm2dlIO::readGm2dl(), g2o::SensorOdometry< R, E, O >::sense(), g2o::SensorPose3DOffset::sense(), g2o::SensorOdometry2D::sense(), g2o::SensorOdometry3D::sense(), g2o::SensorPose3D::sense(), g2o::SensorSE3Prior::sense(), g2o::SensorPointXYZDepth::sense(), g2o::SensorPointXY::sense(), g2o::SensorPose2D::sense(), g2o::SensorPointXYZ::sense(), g2o::SensorSegment2DPointLine::sense(), g2o::SensorPointXYZDisparity::sense(), g2o::SensorSegment2DLine::sense(), g2o::SensorSegment2D::sense(), g2o::SensorPointXYBearing::sense(), g2o::SensorPointXYOffset::sense(), and setFixed().
void g2o::OptimizableGraph::addGraph | ( | OptimizableGraph * | g | ) |
adds all edges and vertices of the graph g to this graph.
Definition at line 741 of file optimizable_graph.cpp.
References addEdge(), addVertex(), g2o::OptimizableGraph::Vertex::clone(), g2o::OptimizableGraph::Edge::clone(), g2o::HyperGraph::Vertex::edges(), g2o::HyperGraph::edges(), g2o::HyperGraph::Vertex::id(), g2o::HyperGraph::Edge::resize(), g2o::OptimizableGraph::Vertex::setHessianIndex(), g2o::HyperGraph::Edge::setVertex(), g2o::HyperGraph::Edge::vertex(), g2o::HyperGraph::Edge::vertices(), and g2o::HyperGraph::vertices().
|
inline |
Definition at line 611 of file optimizable_graph.h.
Referenced by main().
bool g2o::OptimizableGraph::addPostIterationAction | ( | HyperGraphAction * | action | ) |
add an action to be executed after each iteration
Definition at line 855 of file optimizable_graph.cpp.
References _graphActions, and AT_POSTITERATION.
Referenced by main().
bool g2o::OptimizableGraph::addPreIterationAction | ( | HyperGraphAction * | action | ) |
add an action to be executed before each iteration
Definition at line 861 of file optimizable_graph.cpp.
References _graphActions, and AT_PREITERATION.
Referenced by g2o::RunG2OViewer::run().
|
virtual |
adds a new vertex. The new vertex is then "taken".
Definition at line 231 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Vertex::_graph, g2o::HyperGraph::addVertex(), g2o::HyperGraph::Vertex::id(), g2o::HyperGraph::DataContainer::setUserData(), and g2o::HyperGraph::Edge::vertex().
Referenced by addGraph(), g2o::addOdometryCalibLinksDifferential(), g2o::G2oSlamInterface::addVertex(), main(), g2o::Gm2dlIO::readGm2dl(), and setFixed().
|
inlinevirtual |
adds a vertex to the graph. The id of the vertex should be set before invoking this function. the function fails if another vertex with the same id is already in the graph. returns true, on success, or false on failure.
Reimplemented from g2o::HyperGraph.
Definition at line 513 of file optimizable_graph.h.
References addVertex(), and types.
Referenced by addVertex().
double g2o::OptimizableGraph::chi2 | ( | ) | const |
returns the chi2 of the current configuration
Definition at line 315 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Edge::chi2(), and g2o::HyperGraph::edges().
Referenced by main().
|
virtual |
remove the parameters of the graph
Definition at line 940 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Edge::_parameters, and g2o::HyperGraph::clear().
Referenced by ~OptimizableGraph().
std::set< int > g2o::OptimizableGraph::dimensions | ( | ) | const |
iterates over all vertices and returns a set of all the vertex dimensions in the graph
Definition at line 823 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Vertex::dimension(), and g2o::HyperGraph::Edge::vertices().
Referenced by isSolverSuitable(), MainWindow::load(), and main().
|
virtual |
discard the last backup of the estimate for all variables by removing it from the stack
Reimplemented in g2o::SparseOptimizer.
Definition at line 341 of file optimizable_graph.cpp.
References g2o::HyperGraph::Edge::_vertices, and g2o::OptimizableGraph::Vertex::discardTop().
Referenced by g2o::SparseOptimizer::solver().
|
virtual |
ignore the latest stored element on the stack, remove it from the stack but do not restore the estimate
Definition at line 365 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Vertex::discardTop().
|
static |
Eigen starting from version 3.1 requires that we call an initialize function, if we perform calls to Eigen from several threads. Currently, this function calls Eigen::initParallel if g2o is compiled with OpenMP support and Eigen's version is at least 3.1
Definition at line 980 of file optimizable_graph.cpp.
bool g2o::OptimizableGraph::isSolverSuitable | ( | const OptimizationAlgorithmProperty & | solverProperty, |
const std::set< int > & | vertDims = std::set<int>() |
||
) | const |
test whether a solver is suitable for optimizing this graph.
solverProperty | the solver property to evaluate. |
vertDims | should equal to the set returned by dimensions() to avoid re-evaluating. |
Definition at line 800 of file optimizable_graph.cpp.
References dimensions(), g2o::OptimizationAlgorithmProperty::landmarkDim, g2o::OptimizationAlgorithmProperty::poseDim, and g2o::OptimizationAlgorithmProperty::requiresMarginalize.
Referenced by MainWindow::load(), and main().
|
inline |
the workspace for storing the Jacobians of the graph
Definition at line 640 of file optimizable_graph.h.
Referenced by g2o::G2oSlamInterface::addEdge(), g2o::BlockSolver< Traits >::buildSystem(), and g2o::SparseOptimizerOnline::optimize().
|
inline |
Definition at line 641 of file optimizable_graph.h.
|
virtual |
load the graph from a stream. Uses the Factory singleton for creating the vertices and edges.
Referenced by load(), main(), and setFixed().
bool g2o::OptimizableGraph::load | ( | const char * | filename, |
bool | createEdges = true |
||
) |
Definition at line 629 of file optimizable_graph.cpp.
References __PRETTY_FUNCTION__, and load().
int g2o::OptimizableGraph::maxDimension | ( | ) | const |
return the maximum dimension of all vertices in the graph
Definition at line 765 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Vertex::dimension(), and g2o::HyperGraph::Edge::vertices().
|
virtual |
carry out n iterations
Reimplemented in g2o::SparseOptimizer, g2o::SparseOptimizerOnline, and g2o::SparseOptimizerIncremental.
Definition at line 313 of file optimizable_graph.cpp.
|
inline |
Definition at line 615 of file optimizable_graph.h.
Referenced by main(), and g2o::OptimizableGraph::Edge::resolveParameters().
|
inline |
Definition at line 651 of file optimizable_graph.h.
|
inline |
Definition at line 652 of file optimizable_graph.h.
|
virtual |
pop (restore) the estimate of all variables from the stack
Reimplemented in g2o::SparseOptimizer.
Definition at line 333 of file optimizable_graph.cpp.
References g2o::HyperGraph::Edge::_vertices, and g2o::OptimizableGraph::Vertex::pop().
|
virtual |
pop (restore) the estimate a subset of the variables from the stack
Reimplemented in g2o::SparseOptimizer.
Definition at line 357 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Vertex::pop().
|
virtual |
called at the end of an iteration (argument is the number of the iteration)
Definition at line 844 of file optimizable_graph.cpp.
References _graphActions, actions, and AT_POSTITERATION.
Referenced by g2o::SparseOptimizer::initializeOptimization(), and g2o::SparseOptimizer::optimize().
|
virtual |
called at the beginning of an iteration (argument is the number of the iteration)
Definition at line 833 of file optimizable_graph.cpp.
References _graphActions, actions, and AT_PREITERATION.
Referenced by g2o::SparseOptimizer::initializeOptimization(), and g2o::SparseOptimizer::optimize().
|
virtual |
push the estimate of all variables onto a stack
Reimplemented in g2o::SparseOptimizer.
Definition at line 325 of file optimizable_graph.cpp.
References g2o::HyperGraph::Edge::_vertices, and g2o::OptimizableGraph::Vertex::push().
|
virtual |
push the estimate of a subset of the variables onto a stack
Reimplemented in g2o::SparseOptimizer.
Definition at line 349 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Vertex::push().
bool g2o::OptimizableGraph::removePostIterationAction | ( | HyperGraphAction * | action | ) |
remove an action that should no longer be execured after each iteration
Definition at line 872 of file optimizable_graph.cpp.
References _graphActions, and AT_POSTITERATION.
bool g2o::OptimizableGraph::removePreIterationAction | ( | HyperGraphAction * | action | ) |
remove an action that should no longer be execured before each iteration
Definition at line 867 of file optimizable_graph.cpp.
References _graphActions, and AT_PREITERATION.
|
virtual |
bool g2o::OptimizableGraph::save | ( | const char * | filename, |
int | level = 0 |
||
) | const |
function provided for convenience, see save() above
Definition at line 639 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Edge::_parameters, g2o::HyperGraph::edges(), g2o::OptimizableGraph::Edge::level(), save(), saveEdge(), saveSubset(), saveVertex(), and g2o::HyperGraph::Edge::vertices().
bool g2o::OptimizableGraph::saveEdge | ( | std::ostream & | os, |
OptimizableGraph::Edge * | e | ||
) | const |
Definition at line 920 of file optimizable_graph.cpp.
References _edge_has_id, g2o::HyperGraph::Edge::id(), g2o::Factory::instance(), saveUserData(), g2o::Factory::tag(), g2o::HyperGraph::UnassignedId, g2o::HyperGraph::DataContainer::userData(), g2o::HyperGraph::Edge::vertices(), and g2o::OptimizableGraph::Edge::write().
Referenced by save().
bool g2o::OptimizableGraph::saveParameter | ( | std::ostream & | os, |
Parameter * | v | ||
) | const |
Definition at line 908 of file optimizable_graph.cpp.
References g2o::Parameter::id(), g2o::Factory::instance(), g2o::Factory::tag(), and g2o::Parameter::write().
bool g2o::OptimizableGraph::saveSubset | ( | std::ostream & | os, |
HyperGraph::VertexSet & | vset, | ||
int | level = 0 |
||
) |
save a subgraph to a stream. Again uses the Factory system.
Referenced by g2o::assignHierarchicalEdges(), g2o::computeSimpleStars(), main(), and save().
bool g2o::OptimizableGraph::saveSubset | ( | std::ostream & | os, |
HyperGraph::EdgeSet & | eset | ||
) |
save a subgraph to a stream. Again uses the Factory system.
bool g2o::OptimizableGraph::saveUserData | ( | std::ostream & | os, |
HyperGraph::Data * | v | ||
) | const |
Definition at line 877 of file optimizable_graph.cpp.
References g2o::Factory::instance(), g2o::HyperGraph::Data::next(), g2o::Factory::tag(), and g2o::HyperGraph::Data::write().
Referenced by saveEdge(), and saveVertex().
bool g2o::OptimizableGraph::saveVertex | ( | std::ostream & | os, |
OptimizableGraph::Vertex * | v | ||
) | const |
Definition at line 891 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Vertex::fixed(), g2o::HyperGraph::Vertex::id(), g2o::Factory::instance(), saveUserData(), g2o::Factory::tag(), g2o::HyperGraph::DataContainer::userData(), and g2o::OptimizableGraph::Vertex::write().
Referenced by save().
|
virtual |
overridden from HyperGraph, to mantain the bookkeeping of the caches/parameters and jacobian workspaces consistent upon a change in the veretx.
Reimplemented from g2o::HyperGraph.
Definition at line 289 of file optimizable_graph.cpp.
References _jacobianWorkspace, g2o::HyperGraph::Edge::numUndefinedVertices(), g2o::OptimizableGraph::Edge::resolveCaches(), g2o::OptimizableGraph::Edge::resolveParameters(), g2o::HyperGraph::setEdgeVertex(), and g2o::JacobianWorkspace::updateSize().
Referenced by anonymizeLandmarkEdge(), and anonymizePoseEdge().
|
virtual |
fixes/releases a set of vertices
Definition at line 373 of file optimizable_graph.cpp.
References __PRETTY_FUNCTION__, _edge_has_id, g2o::OptimizableGraph::Edge::_parameters, _renamedTypesLookup, addEdge(), addVertex(), CL_RED, g2o::Factory::construct(), g2o::OptimizableGraph::Edge::createVertex(), g2o::HyperGraph::Data::dataContainer(), HGET_PARAMETER, g2o::HyperGraph::Vertex::id(), g2o::HyperGraph::Edge::id(), g2o::OptimizableGraph::Edge::initialEstimate(), g2o::Factory::instance(), g2o::Factory::knowsTag(), load(), g2o::HyperGraph::Data::read(), g2o::OptimizableGraph::Vertex::read(), g2o::OptimizableGraph::Edge::read(), g2o::readLine(), g2o::HyperGraph::Edge::resize(), g2o::HyperGraph::Data::setDataContainer(), g2o::OptimizableGraph::Vertex::setFixed(), g2o::HyperGraph::Edge::setId(), g2o::OptimizableGraph::Vertex::setId(), g2o::HyperGraph::Data::setNext(), g2o::HyperGraph::DataContainer::setUserData(), g2o::HyperGraph::Edge::setVertex(), g2o::HyperGraph::UnassignedId, g2o::HyperGraph::Edge::vertex(), and g2o::HyperGraph::Edge::vertices().
Referenced by g2o::computeSimpleStars().
void g2o::OptimizableGraph::setRenamedTypesFromString | ( | const std::string & | types | ) |
set the renamed types lookup from a string, format is for example: VERTEX_CAM=VERTEX_SE3:EXPMAP,EDGE_PROJECT_P2MC=EDGE_PROJECT_XYZ:EXPMAP This will change the occurance of VERTEX_CAM in the file to VERTEX_SE3:EXPMAP
Definition at line 774 of file optimizable_graph.cpp.
References __PRETTY_FUNCTION__, _renamedTypesLookup, g2o::Factory::instance(), g2o::Factory::knowsTag(), g2o::strSplit(), and g2o::trim().
Referenced by main().
bool g2o::OptimizableGraph::verifyInformationMatrices | ( | bool | verbose = false | ) | const |
verify that all the information of the edges are semi positive definite, i.e., all Eigenvalues are >= 0.
verbose | output edges with not PSD information matrix on cerr |
Definition at line 946 of file optimizable_graph.cpp.
References g2o::OptimizableGraph::Edge::dimension(), g2o::HyperGraph::edges(), g2o::HyperGraph::Vertex::id(), g2o::OptimizableGraph::Edge::informationData(), g2o::HyperGraph::Edge::vertex(), and g2o::HyperGraph::Edge::vertices().
|
inline |
returns the vertex number id appropriately casted
Definition at line 496 of file optimizable_graph.h.
References g2o::HyperGraph::vertex().
Referenced by g2o::G2oSlamInterface::addEdge(), g2o::G2oSlamInterface::fixNode(), main(), g2o::G2oSlamInterface::queryState(), g2o::Gm2dlIO::readGm2dl(), g2o::SolverSLAM2DLinear::solveOrientation(), g2o::Gm2dlIO::updateLaserData(), and g2o::VertexLine2D::write().
|
inline |
returns the vertex number id appropriately casted
Definition at line 499 of file optimizable_graph.h.
References g2o::HyperGraph::vertex().
|
protected |
Definition at line 660 of file optimizable_graph.h.
Referenced by OptimizableGraph(), saveEdge(), and setFixed().
|
protected |
Definition at line 657 of file optimizable_graph.h.
Referenced by g2o::SparseOptimizer::addComputeErrorAction(), addPostIterationAction(), addPreIterationAction(), g2o::SparseOptimizer::computeActiveErrors(), OptimizableGraph(), postIteration(), preIteration(), g2o::SparseOptimizer::removeComputeErrorAction(), removePostIterationAction(), removePreIterationAction(), and g2o::SparseOptimizer::SparseOptimizer().
|
protected |
Definition at line 663 of file optimizable_graph.h.
Referenced by addEdge(), g2o::SparseOptimizer::initializeOptimization(), and setEdgeVertex().
|
protected |
Definition at line 656 of file optimizable_graph.h.
Referenced by addEdge(), and OptimizableGraph().
|
protected |
Definition at line 662 of file optimizable_graph.h.
|
protected |
Definition at line 655 of file optimizable_graph.h.
Referenced by setFixed(), and setRenamedTypesFromString().
Definition at line 76 of file optimizable_graph.h.
Definition at line 75 of file optimizable_graph.h.