Namespaces | Functions | Variables
rviz_animated_view_controller.cpp File Reference
#include "rviz_animated_view_controller/rviz_animated_view_controller.h"
#include "rviz/load_resource.h"
#include "rviz/uniform_string_stream.h"
#include "rviz/display_context.h"
#include "rviz/viewport_mouse_event.h"
#include "rviz/frame_manager.h"
#include "rviz/geometry.h"
#include "rviz/ogre_helpers/shape.h"
#include "rviz/properties/float_property.h"
#include "rviz/properties/vector_property.h"
#include "rviz/properties/bool_property.h"
#include "rviz/properties/tf_frame_property.h"
#include "rviz/properties/editable_enum_property.h"
#include "rviz/properties/ros_topic_property.h"
#include "view_controller_msgs/CameraPlacement.h"
#include <OGRE/OgreViewport.h>
#include <OGRE/OgreQuaternion.h>
#include <OGRE/OgreVector3.h>
#include <OGRE/OgreSceneNode.h>
#include <OGRE/OgreSceneManager.h>
#include <OGRE/OgreCamera.h>
#include <pluginlib/class_list_macros.h>
Include dependency graph for rviz_animated_view_controller.cpp:

Go to the source code of this file.

Namespaces

namespace  rviz_animated_view_controller

Functions

static geometry_msgs::Point rviz_animated_view_controller::pointOgreToMsg (const Ogre::Vector3 &o)
static void rviz_animated_view_controller::pointOgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Point &m)
static Ogre::Vector3 rviz_animated_view_controller::vectorFromMsg (const geometry_msgs::Point &m)
static Ogre::Vector3 rviz_animated_view_controller::vectorFromMsg (const geometry_msgs::Vector3 &m)
static geometry_msgs::Vector3 rviz_animated_view_controller::vectorOgreToMsg (const Ogre::Vector3 &o)
static void rviz_animated_view_controller::vectorOgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Vector3 &m)

Variables

static const std::string rviz_animated_view_controller::MODE_FPS = "FPS"
static const std::string rviz_animated_view_controller::MODE_ORBIT = "Orbit"
static const Ogre::Radian rviz_animated_view_controller::PITCH_LIMIT_HIGH = Ogre::Radian( Ogre::Math::PI - 0.02)
static const Ogre::Radian rviz_animated_view_controller::PITCH_LIMIT_LOW = Ogre::Radian( 0.02 )


rviz_animated_view_controller
Author(s): Adam Leeper
autogenerated on Thu Jun 6 2019 18:48:44