#include "but_camcast.h"
#include <OGRE/OgreSceneManager.h>
#include "OGRE/OgreWindowEventUtilities.h"
#include "OGRE/OgreManualObject.h"
#include "OGRE/OgreEntity.h"
#include <rviz/render_panel.h>
#include <rviz/visualization_manager.h>
#include <rviz/window_manager_interface.h>
#include <wx/filedlg.h>
#include <sensor_msgs/Image.h>
#include <sstream>
Go to the source code of this file.
Defines | |
#define | CAMERA_SCREENCAST_TOPIC_NAME std::string("rviz_cam_rgb") |
#define | DEFAULT_PUBLISHING_PERIOD double(0.1) |
Functions | |
const int | ID_CHECKBOX (100) |
const int | ID_SAVE_BUTTON (101) |
#define CAMERA_SCREENCAST_TOPIC_NAME std::string("rviz_cam_rgb") |
Definition at line 49 of file but_camcast.cpp.
#define DEFAULT_PUBLISHING_PERIOD double(0.1) |
Definition at line 50 of file but_camcast.cpp.
const int ID_CHECKBOX | ( | 100 | ) |
const int ID_SAVE_BUTTON | ( | 101 | ) |