#include "but_projection.h"
#include <ros/package.h>
#include <OGRE/OgreSceneManager.h>
#include "OGRE/OgreWindowEventUtilities.h"
#include "OGRE/OgreManualObject.h"
#include "OGRE/OgreEntity.h"
#include "OGRE/OgreCompositorManager.h"
#include <ogre_tools/initialization.h>
#include "OgreHardwarePixelBuffer.h"
#include <pcl/ros/conversions.h>
#include <pcl_ros/transforms.h>
#include <rviz/render_panel.h>
#include <rviz/visualization_manager.h>
#include <rviz/window_manager_interface.h>
#include <rviz/frame_manager.h>
#include <rviz/validate_floats.h>
#include <wx/filedlg.h>
#include <sensor_msgs/Image.h>
#include <sstream>
Go to the source code of this file.
Defines | |
#define | CAMERA_INFO_TOPIC_NAME std::string("/cam3d/rgb/camera_info") |
#define | DEFAULT_DEPTH_IMAGE_TOPIC_NAME std::string("/srs_ui_but/depth/image") |
#define | DEFAULT_IMAGE_INPUT_TOPIC_NAME std::string("/cam3d/rgb/image_raw") |
#define | DEFAULT_PUBLISHING_PERIOD double(0.1) |
Functions | |
const int | ID_CHECKBOX (100) |
const int | ID_SAVE_BUTTON (101) |
#define CAMERA_INFO_TOPIC_NAME std::string("/cam3d/rgb/camera_info") |
Definition at line 62 of file but_projection.cpp.
#define DEFAULT_DEPTH_IMAGE_TOPIC_NAME std::string("/srs_ui_but/depth/image") |
Definition at line 61 of file but_projection.cpp.
#define DEFAULT_IMAGE_INPUT_TOPIC_NAME std::string("/cam3d/rgb/image_raw") |
Definition at line 60 of file but_projection.cpp.
#define DEFAULT_PUBLISHING_PERIOD double(0.1) |
Definition at line 63 of file but_projection.cpp.
const int ID_CHECKBOX | ( | 100 | ) |
const int ID_SAVE_BUTTON | ( | 101 | ) |