#include <flirtlib_ros/localization_monitor.h>
#include <flirtlib_ros/conversions.h>
#include <flirtlib_ros/common.h>
#include <flirtlib_ros/ExecutiveState.h>
#include <boost/thread.hpp>
#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <tf/exceptions.h>
#include <geometry_msgs/PoseArray.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <mongo_ros/message_collection.h>
#include <visualization_msgs/Marker.h>
#include <move_base_msgs/MoveBaseActionResult.h>
#include <std_srvs/Empty.h>
Go to the source code of this file.
Classes | |
class | flirtlib_ros::Node |
Namespaces | |
namespace | flirtlib_ros |
Typedefs | |
typedef std::pair < InterestPoint *, InterestPoint * > | flirtlib_ros::Correspondence |
typedef vector< Correspondence > | flirtlib_ros::Correspondences |
typedef mr::MessageWithMetadata < RefScanRos >::ConstPtr | flirtlib_ros::DBScan |
typedef mr::MessageWithMetadata < nm::OccupancyGrid > | flirtlib_ros::MapWithMetadata |
typedef vector< RefScan > | flirtlib_ros::RefScans |
Functions | |
unsigned | flirtlib_ros::getSum (const nm::OccupancyGrid &g) |
This is sort of like a hash for the map. | |
int | main (int argc, char **argv) |
Ros node that updates and localizes using a set of saved scans. The idea is that you can run this all the time in the background, and it will both do startup localization, and update itself over time as the map changes.
Requires:
Provides
Parameters:
Definition in file localization_monitor_node.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 582 of file localization_monitor_node.cpp.