Classes | Namespaces | Typedefs | Functions
scan_manager.h File Reference
#include <graph_slam/constraint_generator.h>
#include <karto_scan_matcher/karto_scan_matcher.h>
#include <ros/assert.h>
#include <boost/shared_ptr.hpp>
#include <boost/bimap.hpp>
#include <boost/optional.hpp>
Include dependency graph for scan_manager.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  graph_slam::ScanManager
 Internally used class that contains sequential scan matching logic When using the ops, you have to instantiate a WithOptimizedPoses RAII object in a containing scope to set the optimized poses before doing anything else. More...
struct  graph_slam::WithOptimizedPoses
 RAII object for making ScanManager use a given set of optimized poses. More...

Namespaces

namespace  graph_slam

Typedefs

typedef std::vector< pg::NodeIdgraph_slam::Chain
typedef std::vector< Chain > graph_slam::ChainVec
typedef boost::shared_ptr
< karto_scan_matcher::KartoScanMatcher
graph_slam::KartoMatcherPtr
typedef
sensor_msgs::LaserScan::ConstPtr 
graph_slam::LaserPtr
typedef std::map< pg::NodeId,
LaserPtr > 
graph_slam::NodeScanMap
typedef boost::bimap
< pg::NodeId, pg::NodeId
graph_slam::NodeSequenceMap
typedef std::set< pg::NodeIdgraph_slam::NodeSet

Functions

void graph_slam::addChain (const Chain &chain, ChainVec *chains, NodeSet *processed)
pg::PrecisionMatrix graph_slam::getPrecisionMatrix (const karto_scan_matcher::ScanMatchResult &res, const bool use_covariances)
 Utility functions for subclasses.
template<typename Map >
Chain graph_slam::onewayChain (const Map &m, const pg::NodeId seed, const NodeSet &allowed, const NodeSet &forbidden)

Detailed Description

Defines ScanManager

Author:
Bhaskara Marthi

Definition in file scan_manager.h.



graph_slam
Author(s): Bhaskara Marthi
autogenerated on Tue Jan 7 2014 11:17:21