#include <algorithm>#include <assert.h>#include <utility>#include <sstream>#include <gazebo_plugins/gazebo_ros_projector.h>#include <ros/callback_queue.h>#include <ros/subscribe_options.h>#include <ros/ros.h>#include "boost/thread/mutex.hpp"#include <gazebo/Controller.hh>#include <gazebo/Param.hh>#include <gazebo/Body.hh>#include <gazebo/Model.hh>#include <std_msgs/String.h>#include <std_msgs/Int32.h>#include <OgrePrerequisites.h>#include <OgreTexture.h>#include <OgreFrameListener.h>#include <X11/Xlib.h>#include <X11/Xutil.h>#include <GL/glx.h>#include "Vector4.hh"#include "Param.hh"#include "Vector2.hh"#include "SingletonT.hh"#include "OgreString.h"#include "OgreMath.h"#include "OgreVector3.h"#include "OgreQuaternion.h"#include "OgreSharedPtr.h"#include "OgreException.h"#include <typeinfo>#include "OgreVector4.h"#include "OgreAny.h"#include "OgreHardwareBuffer.h"#include "OgreColourValue.h"#include "OgreIteratorWrappers.h"#include "OgreAnimable.h"#include "OgreHardwareVertexBuffer.h"#include "OgreAnimationState.h"#include "OgreAnimationTrack.h"#include "OgreDataStream.h"#include "OgreStringVector.h"#include <ctime>#include "OgreResource.h"#include "OgreHeaderPrefix.h"#include "OgreHeaderSuffix.h"#include "OgreCommon.h"#include "OgreArchive.h"#include "OgreSingleton.h"#include "OgreMatrix4.h"#include "OgreAxisAlignedBox.h"#include "OgrePlane.h"#include "OgreRenderOperation.h"#include "OgreSerializer.h"#include "OgreUserObjectBindings.h"#include "OgreRenderable.h"#include "OgreResourceGroupManager.h"#include "OgreMovableObject.h"#include "OgreMatrix3.h"#include "OgreVertexIndexData.h"#include "OgreHardwareIndexBuffer.h"#include "OgrePose.h"#include "OgreSphere.h"#include "OgrePlaneBoundedVolume.h"#include "OgreController.h"#include "OgreGpuProgram.h"#include "OgreBlendMode.h"#include "OgreMaterial.h"#include "OgreMesh.h"#include "OgreFrustum.h"#include "OgreResourceManager.h"#include "OgreHardwareBufferManager.h"#include "OgrePixelFormat.h"#include "OgreImage.h"#include "OgreHardwarePixelBuffer.h"#include "OgreHighLevelGpuProgram.h"#include "OgreKeyFrame.h"#include "OgreMovablePlane.h"#include "OgreTextureUnitState.h"#include "OgreMaterialSerializer.h"#include "OgreNode.h"#include "OgreStringInterface.h"#include "OgreOverlayElement.h"#include "OgreOverlay.h"#include "OgreScriptLoader.h"#include "OgreRadixSort.h"#include "OgreLight.h"#include "OgrePatchMesh.h"#include "OgrePatchSurface.h"#include "OgrePass.h"#include "OgreLogManager.h"#include "OgreRenderQueue.h"#include "OgreRenderSystemCapabilities.h"#include "OgrePlatform.h"#include "WIN32/OgreTimerImp.h"#include "OgreRenderTarget.h"#include "OgreRenderTexture.h"#include "OgreAtomicWrappers.h"#include "OgreBillboardChain.h"#include "OgreControllerManager.h"#include "OgreSceneNode.h"#include "OgreRay.h"#include "OgreRenderQueueSortingGrouping.h"#include "OgreShadowCameraSetup.h"#include "OgreCamera.h"#include "OgreSimpleRenderable.h"#include "OgreSkeleton.h"#include "OgreBone.h"#include "OgreRenderSystem.h"#include "OgreWorkQueue.h"#include <exception>#include "OgreSceneManager.h"#include "OgreSceneManagerEnumerator.h"#include "OgreSkeletonInstance.h"#include "OgreLodStrategy.h"#include "OgreStringConverter.h"#include "OgreVertexBoneAssignment.h"#include "OgreProgressiveMesh.h"#include "OgreTechnique.h"#include "OgreTextureManager.h"#include "OgreVector2.h"#include "OgreViewport.h"#include "OgreCompositor.h"#include "OgreRectangle2D.h"#include "OgreRenderTargetListener.h"#include "OgreRenderQueueListener.h"#include "OgreMaterialManager.h"#include "OgreCompositionTechnique.h"#include "OgreCompositorInstance.h"#include <windows.h>#include "OgrePolygon.h"#include "OgreShadowCameraSetupFocused.h"#include "OgreShadowCameraSetupLiSPSM.h"#include <string>#include "Pose3d.hh"#include "Quatern.hh"#include "Vector3.hh"#include "Common.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 <Ogre.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 40 of file gazebo_ros_projector.cpp.
| typedef OgrePassMap::iterator OgrePassMapIterator |
Definition at line 41 of file gazebo_ros_projector.cpp.
| GZ_REGISTER_DYNAMIC_CONTROLLER | ( | "gazebo_ros_projector" | , | |
| GazeboRosProjector | ||||
| ) |