#include <QObject>#include "octomap_rviz_plugins/occupancy_grid_display.h"#include <boost/bind.hpp>#include <boost/shared_ptr.hpp>#include <OGRE/OgreSceneNode.h>#include <OGRE/OgreSceneManager.h>#include "rviz/visualization_manager.h"#include "rviz/frame_manager.h"#include "rviz/properties/int_property.h"#include "rviz/properties/ros_topic_property.h"#include "rviz/properties/enum_property.h"#include "rviz/properties/float_property.h"#include <octomap/octomap.h>#include <octomap/ColorOcTree.h>#include <octomap_msgs/Octomap.h>#include <octomap_msgs/conversions.h>#include <sstream>#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Namespaces | |
| octomap_rviz_plugin | |
Variables | |
| static const std::size_t | octomap_rviz_plugin::max_octree_depth_ = sizeof(unsigned short) * 8 |
| typedef octomap_rviz_plugin::TemplatedOccupancyGridDisplay<octomap::ColorOcTree> ColorOcTreeGridDisplay |
Definition at line 622 of file occupancy_grid_display.cpp.
Definition at line 621 of file occupancy_grid_display.cpp.
| typedef octomap_rviz_plugin::TemplatedOccupancyGridDisplay<octomap::OcTreeStamped> OcTreeStampedGridDisplay |
Definition at line 623 of file occupancy_grid_display.cpp.