$search
#include <algorithm>
#include <vector>
#include <map>
#include <boost/bind.hpp>
#include <boost/thread/mutex.hpp>
#include "map/map.h"
#include <stdint.h>
#include "pf_vector.h"
#include "pf_kdtree.h"
#include "amcl_sensor.h"
#include "../pf/pf_pdf.h"
#include "../map/map.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 "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) |
#define NEW_UNIFORM_SAMPLING 1 |
Definition at line 58 of file amcl_node.cpp.
#define USAGE "USAGE: amcl" |
Definition at line 222 of file amcl_node.cpp.
static double angle_diff | ( | double | a, | |
double | b | |||
) | [static] |
Definition at line 82 of file amcl_node.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 225 of file amcl_node.cpp.
static double normalize | ( | double | z | ) | [static] |
Definition at line 77 of file amcl_node.cpp.