#include <boost/circular_buffer.hpp>
#include <cv_bridge/cv_bridge.h>
#include <image_transport/image_transport.h>
#include "rviz/view_controller.h"
#include "rviz/view_manager.h"
#include "rviz/render_panel.h"
#include <ros/subscriber.h>
#include <ros/ros.h>
#include <geometry_msgs/Pose.h>
#include <std_msgs/Bool.h>
#include <std_msgs/Duration.h>
#include <view_controller_msgs/CameraMovement.h>
#include <view_controller_msgs/CameraPlacement.h>
#include <view_controller_msgs/CameraTrajectory.h>
#include <OGRE/OgreRenderWindow.h>
#include <OGRE/OgreVector3.h>
#include <OGRE/OgreQuaternion.h>
Go to the source code of this file.