#include <ros/ros.h>#include <sensor_msgs/LaserScan.h>#include <sensor_msgs/PointCloud.h>#include <nav_msgs/Odometry.h>#include <tf/transform_listener.h>#include <mrpt_bridge/pose.h>#include <mrpt_bridge/laser_scan.h>#include <mrpt_bridge/point_cloud.h>#include <map>#include <mrpt/version.h>#include <mrpt/obs/CSensoryFrame.h>#include <mrpt/maps/CSimplePointsMap.h>#include <mrpt/maps/COccupancyGridMap2D.h>#include <mrpt/obs/CObservation2DRangeScan.h>#include <mrpt/system/string_utils.h>#include <mrpt/utils/CTimeLogger.h>#include <mrpt/utils/CConfigFile.h>#include <mrpt/gui/CDisplayWindow3D.h>#include <mrpt/opengl/CGridPlaneXY.h>#include <mrpt/opengl/CPointCloud.h>#include <mrpt/opengl/stock_objects.h>
Go to the source code of this file.
Classes | |
| class | LocalObstaclesNode |
| struct | LocalObstaclesNode::TAuxInitializer |
| struct | LocalObstaclesNode::TInfoPerTimeStep |
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 439 of file mrpt_local_obstacles_node.cpp.