$search
#include <algorithm>#include <assert.h>#include <utility>#include <sstream>#include <gazebo_plugins/gazebo_ros_projector.h>#include <gazebo/OgreAdaptor.hh>#include <gazebo/OgreVisual.hh>#include <gazebo/Sensor.hh>#include <gazebo/Global.hh>#include <gazebo/XMLConfig.hh>#include <gazebo/Simulator.hh>#include <gazebo/gazebo.h>#include <gazebo/World.hh>#include <gazebo/GazeboError.hh>#include <gazebo/ControllerFactory.hh>#include <gazebo/Vector3.hh>#include <gazebo/Quatern.hh>#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.
Typedefs | |
| typedef std::map< std::string, Ogre::Pass * > | OgrePassMap |
| typedef OgrePassMap::iterator | OgrePassMapIterator |
Functions | |
| GZ_REGISTER_DYNAMIC_CONTROLLER ("gazebo_ros_projector", GazeboRosProjector) | |
| typedef std::map<std::string,Ogre::Pass*> OgrePassMap |
Definition at line 42 of file gazebo_ros_projector.cpp.
| typedef OgrePassMap::iterator OgrePassMapIterator |
Definition at line 43 of file gazebo_ros_projector.cpp.
| GZ_REGISTER_DYNAMIC_CONTROLLER | ( | "gazebo_ros_projector" | , | |
| GazeboRosProjector | ||||
| ) |