#include <graph_slam/constraints/fake_loop_closure.h>
#include <graph_slam/constraints/odom.h>
#include <graph_slam/constraints/karto_laser_constraints.h>
#include <pose_graph/exception.h>
#include <ros/ros.h>
Go to the source code of this file.
Namespaces | |
namespace | graph_slam |
Functions | |
ConstraintGenPtr | graph_slam::createConstraintGenerator (const ros::NodeHandle &nh) |
template<class T > | |
T | graph_slam::getPrivateParam (const ros::NodeHandle &nh, const string &name, const T &default_val) |
Implementation of the factory method for constraint generators
Definition in file constraint_generator.cpp.