#include <algorithm>
#include <vector>
#include <map>
#include <cmath>
#include <boost/bind.hpp>
#include <boost/thread/mutex.hpp>
#include <signal.h>
#include "amcl/map/map.h"
#include "amcl/pf/pf.h"
#include "amcl/sensors/amcl_odom.h"
#include "amcl/sensors/amcl_laser.h"
#include "ros/assert.h"
#include "ros/ros.h"
#include "sensor_msgs/LaserScan.h"
#include "geometry_msgs/PoseWithCovarianceStamped.h"
#include "geometry_msgs/PoseArray.h"
#include "geometry_msgs/Pose.h"
#include "nav_msgs/GetMap.h"
#include "nav_msgs/SetMap.h"
#include "std_srvs/Empty.h"
#include "tf/transform_broadcaster.h"
#include "tf/transform_listener.h"
#include "tf/message_filter.h"
#include "tf/tf.h"
#include "message_filters/subscriber.h"
#include "dynamic_reconfigure/server.h"
#include "amcl/AMCLConfig.h"
#include <rosbag/bag.h>
#include <rosbag/view.h>
#include <boost/foreach.hpp>
Go to the source code of this file.
#define NEW_UNIFORM_SAMPLING 1 |
#define USAGE "USAGE: amcl" |
static double angle_diff |
( |
double |
a, |
|
|
double |
b |
|
) |
| |
|
static |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
static double normalize |
( |
double |
z | ) |
|
|
static |
void sigintHandler |
( |
int |
sig | ) |
|
const std::string scan_topic_ = "scan" |
|
static |