#include <algorithm>#include <assert.h>#include <utility>#include <sstream>#include "rendering/Rendering.hh"#include "rendering/Scene.hh"#include "rendering/Visual.hh"#include "rendering/RTShaderSystem.hh"#include <gazebo_plugins/gazebo_ros_projector.h>#include "std_msgs/String.h"#include "std_msgs/Int32.h"#include <Ogre.h>#include <OgreMath.h>#include <OgreSceneNode.h>#include <OgreFrustum.h>#include <OgreSceneQuery.h>
Go to the source code of this file.
Namespaces | |
| namespace | gazebo |
Typedefs | |
| typedef std::map< std::string, Ogre::Pass * > | gazebo::OgrePassMap |
| typedef OgrePassMap::iterator | gazebo::OgrePassMapIterator |
Functions | |
| gazebo::GZ_REGISTER_MODEL_PLUGIN (GazeboRosProjector) | |