#include "rviz/display.h"#include "rviz/frame_manager.h"#include "rviz/image/image_display_base.h"#include "rviz/image/ros_image_texture.h"#include <image_transport/image_transport.h>#include <sensor_msgs/CameraInfo.h>#include <message_filters/subscriber.h>#include <tf/message_filter.h>#include <geometry_msgs/Pose.h>#include <geometry_msgs/PoseStamped.h>#include <shape_msgs/Mesh.h>#include <std_msgs/Float64.h>#include <tf/transform_listener.h>#include <OGRE/OgreVector3.h>#include "OGRE/OgreRoot.h"#include "OGRE/OgreRenderSystem.h"#include "OGRE/OgreRenderWindow.h"#include "OGRE/OgreWindowEventUtilities.h"#include "OGRE/OgreManualObject.h"#include "OGRE/OgreEntity.h"#include <OGRE/OgreSceneNode.h>#include <OGRE/OgreRenderTargetListener.h>#include <OGRE/OgreRenderQueueListener.h>#include <rviz_textured_quads/TexturedQuad.h>#include <rviz_textured_quads/TexturedQuadArray.h>#include <Eigen/Core>#include <Eigen/Geometry>#include <tf/tf.h>#include <tf_conversions/tf_eigen.h>#include <eigen_conversions/eigen_msg.h>#include <map>#include <vector>#include "text_node.h"

Go to the source code of this file.
Classes | |
| class | rviz::MeshDisplayCustom |
| Uses a pose from topic + offset to render a bounding object with shape, size and color. More... | |
Namespaces | |
| namespace | Ogre |
| namespace | rviz |