#include "pr2_interactive_manipulation/object_selection_frame.h"#include "rviz_interaction_tools/image_tools.h"#include <cstring>#include <sensor_msgs/Image.h>#include <sensor_msgs/CameraInfo.h>#include <sensor_msgs/PointCloud2.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "std_msgs/Header.h"#include "sensor_msgs/RegionOfInterest.h"#include <cmath>#include "rviz_interaction_tools/mesh_object.h"#include <OGRE/OgreCamera.h>#include <ogre_tools/point_cloud.h>#include "OgrePrerequisites.h"#include "OgreMovableObject.h"#include "OgreRenderable.h"#include "OgreResourceGroupManager.h"#include <OGRE/OgreMaterialManager.h>#include "OgreRenderTarget.h"#include <OGRE/OgreSceneNode.h>#include <OGRE/OgreSceneManager.h>#include <OGRE/OgreRoot.h>#include <rviz/render_panel.h>#include <rviz/window_manager_interface.h>#include <rviz/visualization_manager.h>#include <stereo_msgs/DisparityImage.h>#include <OGRE/OgreTexture.h>#include <OGRE/OgreImage.h>#include <OGRE/OgreMaterial.h>#include <boost/thread/mutex.hpp>#include "rviz_interaction_tools/camera_tools.h"#include "rviz_interaction_tools/unique_string_manager.h"#include "ros/service_traits.h"#include "household_objects_database_msgs/DatabaseReturnCode.h"#include "geometric_shapes_msgs/Shape.h"

Go to the source code of this file.
Namespaces | |
| namespace | pr2_interactive_manipulation |
Variables | |
| static const std::string | mat_base_name = "object_selection_frame" |
const std::string mat_base_name = "object_selection_frame" [static] |
Definition at line 59 of file object_selection_frame.cpp.