1 #ifndef __TINY_SLAM_FASCADE_H 2 #define __TINY_SLAM_FASCADE_H 6 #include "../ros/laser_scan_observer.h" 7 #include "../ros/rviz_grid_viewer.h" 8 #include "../core/maps/grid_cell_strategy.h" 45 void set_viewer(std::shared_ptr<RvizGridViewer> viewer) {
57 _world->handle_observation(scan);
70 _world->scan_matcher()->subscribe(obs);
78 _world->scan_matcher()->unsubscribe(obs);
TinySlamFascade(std::shared_ptr< GridCellStrategy > gcs, const TinyWorldParams ¶ms, const GridMapParams &init_map_params, bool skip_max_vals)
std::shared_ptr< RvizGridViewer > _viewer
virtual void handle_laser_scan(TransformedLaserScan &scan)
Class responsibilities: observes laser scans and odometry; converts ROS structures to internal repres...
std::unique_ptr< TinyWorld > _world
void remove_scan_matcher_observer(ScanMatcherObsPtr obs)
A container for the following tinySLAM parameters: TODO: params description.
void add_scan_matcher_observer(ScanMatcherObsPtr obs)
The class implements the tinySLAM-specific map update logic.
void set_viewer(std::shared_ptr< RvizGridViewer > viewer)
The TinySLAM access point. SLAM users are supposed to work with it.
std::shared_ptr< GridScanMatcherObserver > ScanMatcherObsPtr