#include <utility>
#include <sensor_msgs/LaserScan.h>
#include <boost/shared_ptr.hpp>
#include "../core/sensor_data.h"
#include "topic_with_transform.h"
Go to the source code of this file.
Classes | |
class | LaserScanObserver |
Class responsibilities: observes laser scans and odometry; converts ROS structures to internal representation. More... |