#include <sys/time.h>
#include <visualization_msgs/Marker.h>
#include <geometry_msgs/Point.h>
#include "graph_manager.h"
#include "misc.h"
#include "pcl_ros/transforms.h"
#include "pcl/io/pcd_io.h"
#include <sensor_msgs/PointCloud2.h>
#include <opencv2/features2d/features2d.hpp>
#include <QThread>
#include <qtconcurrentrun.h>
#include <QtConcurrentMap>
#include <QFile>
#include <utility>
#include <fstream>
#include <limits>
#include <boost/foreach.hpp>
#include <pcl_ros/point_cloud.h>
#include "g2o/math_groups/se3quat.h"
#include "g2o/types/slam3d/edge_se3_quat.h"
#include "g2o/core/block_solver.h"
#include "g2o/solvers/csparse/linear_solver_csparse.h"
#include "g2o/solvers/cholmod/linear_solver_cholmod.h"
#include "g2o/solvers/pcg/linear_solver_pcg.h"
Go to the source code of this file.
Typedefs | |
typedef std::set < g2o::HyperGraph::Edge * > | EdgeSet |
typedef g2o::BlockSolver < g2o::BlockSolverTraits< 6, 3 > > | SlamBlockSolver |
typedef g2o::LinearSolverCholmod < SlamBlockSolver::PoseMatrixType > | SlamLinearCholmodSolver |
typedef g2o::LinearSolverCSparse < SlamBlockSolver::PoseMatrixType > | SlamLinearCSparseSolver |
typedef g2o::LinearSolverPCG < SlamBlockSolver::PoseMatrixType > | SlamLinearPCGSolver |
typedef std::tr1::unordered_map< int, g2o::HyperGraph::Vertex * > | VertexIDMap |
typedef std::pair< int, g2o::HyperGraph::Vertex * > | VertexIDPair |
Definition at line 55 of file graph_manager.cpp.
typedef g2o::BlockSolver< g2o::BlockSolverTraits<6, 3> > SlamBlockSolver |
Definition at line 47 of file graph_manager.cpp.
typedef g2o::LinearSolverCholmod<SlamBlockSolver::PoseMatrixType> SlamLinearCholmodSolver |
Definition at line 49 of file graph_manager.cpp.
typedef g2o::LinearSolverCSparse<SlamBlockSolver::PoseMatrixType> SlamLinearCSparseSolver |
Definition at line 48 of file graph_manager.cpp.
typedef g2o::LinearSolverPCG<SlamBlockSolver::PoseMatrixType> SlamLinearPCGSolver |
Definition at line 50 of file graph_manager.cpp.
typedef std::tr1::unordered_map<int, g2o::HyperGraph::Vertex*> VertexIDMap |
Definition at line 52 of file graph_manager.cpp.
typedef std::pair<int, g2o::HyperGraph::Vertex*> VertexIDPair |
Definition at line 53 of file graph_manager.cpp.