#include <string>
#include <vector>
#include <boost/optional.hpp>
#include <geometry_msgs/PoseStamped.h>
#include <ros/ros.h>
#include <ros/time.h>
#include <rviz/display.h>
#include <sensor_msgs/NavSatFix.h>
#include <tf2_ros/buffer.h>
#include <OGRE/OgreMaterial.h>
#include <OGRE/OgreVector3.h>
#include "coordinates.h"
#include "ogre_tile.h"
#include "position_reference.h"
#include "tile_cache_delay.h"
Go to the source code of this file.
Classes | |
class | rviz::AerialMapDisplay |
Displays a satellite map along the XY plane. More... | |
struct | rviz::AerialMapDisplay::MapObject |
Namespaces | |
Ogre | |
rviz | |
Enumerations | |
enum | rviz::MapTransformType { rviz::MapTransformType::VIA_MAP_FRAME, rviz::MapTransformType::VIA_UTM_FRAME } |
Whether the tiles should be transformed via an intermediate map frame, or directly via a UTM frame. More... | |