#include <algorithm>#include <vector>#include <map>#include <cmath>#include <boost/bind.hpp>#include <boost/thread/mutex.hpp>#include "map/map.h"#include "pf/pf.h"#include "sensors/amcl_odom.h"#include "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 "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"
Go to the source code of this file.
Classes | |
| struct | amcl_hyp_t | 
| class | AmclNode | 
Defines | |
| #define | NEW_UNIFORM_SAMPLING 1 | 
| #define | USAGE "USAGE: amcl" | 
Functions | |
| static double | angle_diff (double a, double b) | 
| int | main (int argc, char **argv) | 
| static double | normalize (double z) | 
Variables | |
| static const std::string | scan_topic_ = "scan" | 
| #define NEW_UNIFORM_SAMPLING 1 | 
Definition at line 60 of file amcl_node.cpp.
| #define USAGE "USAGE: amcl" | 
Definition at line 229 of file amcl_node.cpp.
| static double angle_diff | ( | double | a, | 
| double | b | ||
| ) |  [static] | 
        
Definition at line 84 of file amcl_node.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 232 of file amcl_node.cpp.
| static double normalize | ( | double | z | ) |  [static] | 
        
Definition at line 79 of file amcl_node.cpp.
const std::string scan_topic_ = "scan" [static] | 
        
Definition at line 99 of file amcl_node.cpp.