Graph class. More...
#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <g2o/core/sparse_optimizer.h>
#include <g2o/core/block_solver.h>
#include <g2o/solvers/cholmod/linear_solver_cholmod.h>
#include <g2o/core/optimization_algorithm_gauss_newton.h>
#include <g2o/types/slam3d/edge_se3.h>
#include <g2o/core/optimization_algorithm_levenberg.h>
#include <g2o/solvers/dense/linear_solver_dense.h>
#include "common/tools.h"
Go to the source code of this file.
Classes | |
class | slam::Graph |
struct | slam::Graph::Params |
Namespaces | |
namespace | slam |
Typedefs | |
typedef g2o::BlockSolver < g2o::BlockSolverTraits<-1,-1 > > | SlamBlockSolver |
typedef g2o::LinearSolverCholmod < SlamBlockSolver::PoseMatrixType > | SlamLinearSolver |
Graph class.
Definition in file graph.h.
typedef g2o::BlockSolver< g2o::BlockSolverTraits<-1, -1> > SlamBlockSolver |
typedef g2o::LinearSolverCholmod<SlamBlockSolver::PoseMatrixType> SlamLinearSolver |