#include "ros_rtt_texture.h"
#include "sensor_msgs/image_encodings.h"
#include <tf/tf.h>
#include <OGRE/OgreTextureManager.h>
#include "OGRE/OgreMaterialManager.h"
#include "OGRE/OgreHardwarePixelBuffer.h"
#include "OGRE/OgreRoot.h"
#include "OGRE/OgreRenderWindow.h"
Go to the source code of this file.
Namespaces | |
namespace | srs_ui_but |
Defines | |
#define | BPP 4 |
#define | BPP_DEPTH 2 |
#define | OGRE_DEPTH_TEXTURE_FORMAT Ogre::PF_FLOAT16_R |
#define | OGRE_TEXTURE_FORMAT Ogre::PF_BYTE_BGRA |
#define | ROS_IMAGE_FORMAT sensor_msgs::image_encodings::BGRA8 |
#define BPP 4 |
Definition at line 45 of file ros_rtt_texture.cpp.
#define BPP_DEPTH 2 |
Definition at line 46 of file ros_rtt_texture.cpp.
#define OGRE_DEPTH_TEXTURE_FORMAT Ogre::PF_FLOAT16_R |
Definition at line 43 of file ros_rtt_texture.cpp.
#define OGRE_TEXTURE_FORMAT Ogre::PF_BYTE_BGRA |
Definition at line 42 of file ros_rtt_texture.cpp.
Definition at line 44 of file ros_rtt_texture.cpp.