00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020
00021
00022
00023
00024
00025
00026
00027
00028
00029
00030
00039 #ifndef LASER_SLAM_SCAN_MATCHING_H
00040 #define LASER_SLAM_SCAN_MATCHING_H
00041
00042 #include <laser_slam/LocalizedScan.h>
00043 #include <laser_slam/util.h>
00044 #include <karto_scan_matcher/karto_scan_matcher.h>
00045 #include <pose_graph/constraint_graph.h>
00046 #include <pose_graph/graph_db.h>
00047
00048 namespace laser_slam
00049 {
00050
00051 typedef boost::shared_ptr<karto_scan_matcher::KartoScanMatcher> MatcherPtr;
00052
00053 karto_scan_matcher::ScanMatchResult scanMatchNodes (const pose_graph::ConstraintGraph& g, MatcherPtr matcher,
00054 const pose_graph::NodeSet& nodes, const ScanMap& scans,
00055 const sensor_msgs::LaserScan& scan,
00056 const tf::Pose& init_estimate, const tf::Pose& laser_offset);
00057
00058
00060 karto_scan_matcher::ScanMatchResult globalLocalization (const pose_graph::ConstraintGraph& g, MatcherPtr local_matcher,
00061 const pose_graph::NodeSet& nodes, const ScanMap& scans,
00062 const sensor_msgs::LaserScan& scan, const tf::Pose& laser_offset,
00063 double global_resolution, double angular_resolution);
00064
00066 karto_scan_matcher::ScanMatchResult globalLocalization (const pose_graph::ConstraintGraph& g, MatcherPtr local_matcher,
00067 const pose_graph::NodeSet& nodes, const ScanMap& scans,
00068 const sensor_msgs::LaserScan& scan, const tf::Pose& laser_offset,
00069 double global_resolution, double angular_resolution,
00070 double min_x, double min_y, double max_x, double max_y);
00071
00072 }
00073
00074 #endif // include guard