$search

bosch_object_segmentation_gui::ObjectSegmentationRvizUI Class Reference

#include <object_segmentation_rviz_ui.h>

Inheritance diagram for bosch_object_segmentation_gui::ObjectSegmentationRvizUI:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 ObjectSegmentationRvizUI (rviz::VisualizationManager *visualization_manager)
void startActionServer (ros::NodeHandle &node_handle)
void stopActionServer ()
virtual void update (float wall_dt, float ros_dt)
virtual ~ObjectSegmentationRvizUI ()

Protected Member Functions

virtual void acceptButtonClicked (wxCommandEvent &)
void acceptNewGoal ()
virtual void cancelButtonClicked (wxCommandEvent &)
void cleanupAndHide ()
void createRenderPanel (rviz::VisualizationManager *visualization_manager)
virtual void onRenderWindowMouseEvents (wxMouseEvent &event)
void preempt ()
void reconstructAndClusterPointCloud (ObjectSegmentationGuiResult &result)
virtual void resetButtonClicked (wxCommandEvent &)
virtual void segmentButtonClicked (wxCommandEvent &)
void stopSegmentation ()

Protected Attributes

rviz_interaction_tools::ImageOverlayimage_overlay_
actionlib::SimpleActionServer
< ObjectSegmentationGuiAction > * 
object_segmentation_server_
rviz::RenderPanelrender_panel_
Ogre::SceneManager * scene_manager_
Ogre::SceneNode * scene_root_
rviz::WindowManagerInterfacewindow_manager_

Private Types

typedef geometry_msgs::Point32 Point
enum  ResetType {
  PLAIN, COLOR, SURFACE, DISP,
  HOLES, UNIFORM
}

Private Member Functions

bool convertImageMessageToMat (const sensor_msgs::Image &image_msg, Mat &image)
bool convertMatToImageMessage (const Mat &image, sensor_msgs::Image &image_msg)
void fillRgbImage (sensor_msgs::Image &rgb_img, const sensor_msgs::PointCloud2 &point_cloud)
bool getDepthImage (sensor_msgs::Image &image_msg)
void overlaySegmentationMask ()
void resetVars ()
void updateImageOverlay ()

Private Attributes

cv::Mat binary_mask_
std::vector
< sensor_msgs::PointCloud
clusters_
sensor_msgs::CameraInfo current_camera_info_
sensor_msgs::Image current_depth_image_
stereo_msgs::DisparityImage current_disparity_image_
sensor_msgs::Image current_image_
int current_marker_id_
 The current marker being published.
sensor_msgs::PointCloud2 current_point_cloud_
image_transport::Publisher image_pub_
 Publishing images (for debug only).
ros::Publisher marker_pub_
 Publisher for markers.
ros::NodeHandle nh_
 The node handle.
int num_markers_published_
 Used to remember the number of markers we publish so we can delete them later.
GrabCut3DObjectSegmenterobject_segmenter_
ros::NodeHandle priv_nh_
 The node handle.
TableDetector table_detector_

Detailed Description

Definition at line 73 of file object_segmentation_rviz_ui.h.


Member Typedef Documentation

Definition at line 75 of file object_segmentation_rviz_ui.h.


Member Enumeration Documentation

Enumerator:
PLAIN 
COLOR 
SURFACE 
DISP 
HOLES 
UNIFORM 

Definition at line 128 of file object_segmentation_rviz_ui.h.


Constructor & Destructor Documentation

bosch_object_segmentation_gui::ObjectSegmentationRvizUI::ObjectSegmentationRvizUI ( rviz::VisualizationManager visualization_manager  ) 

Definition at line 88 of file object_segmentation_rviz_ui.cpp.

bosch_object_segmentation_gui::ObjectSegmentationRvizUI::~ObjectSegmentationRvizUI (  )  [virtual]

Definition at line 126 of file object_segmentation_rviz_ui.cpp.


Member Function Documentation

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::acceptButtonClicked ( wxCommandEvent &   )  [protected, virtual]

Reimplemented from ObjectSegmentationFrame.

Definition at line 459 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::acceptNewGoal (  )  [protected]

Definition at line 255 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::cancelButtonClicked ( wxCommandEvent &   )  [protected, virtual]

Reimplemented from ObjectSegmentationFrame.

Definition at line 483 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::cleanupAndHide (  )  [protected]

Definition at line 341 of file object_segmentation_rviz_ui.cpp.

bool bosch_object_segmentation_gui::ObjectSegmentationRvizUI::convertImageMessageToMat ( const sensor_msgs::Image image_msg,
Mat &  image 
) [private]

Definition at line 296 of file object_segmentation_rviz_ui.cpp.

bool bosch_object_segmentation_gui::ObjectSegmentationRvizUI::convertMatToImageMessage ( const Mat &  image,
sensor_msgs::Image image_msg 
) [private]

Definition at line 315 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::createRenderPanel ( rviz::VisualizationManager visualization_manager  )  [protected]

Definition at line 137 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::fillRgbImage ( sensor_msgs::Image rgb_img,
const sensor_msgs::PointCloud2 point_cloud 
) [private]

Definition at line 424 of file object_segmentation_rviz_ui.cpp.

bool bosch_object_segmentation_gui::ObjectSegmentationRvizUI::getDepthImage ( sensor_msgs::Image image_msg  )  [private]

Definition at line 208 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::onRenderWindowMouseEvents ( wxMouseEvent &  event  )  [protected, virtual]

Definition at line 374 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::overlaySegmentationMask (  )  [private]
void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::preempt (  )  [protected]

Definition at line 334 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::reconstructAndClusterPointCloud ( ObjectSegmentationGuiResult result  )  [protected]

Definition at line 513 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::resetButtonClicked ( wxCommandEvent &   )  [protected, virtual]

Reimplemented from ObjectSegmentationFrame.

Definition at line 490 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::resetVars (  )  [private]

Definition at line 352 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::segmentButtonClicked ( wxCommandEvent &   )  [protected, virtual]

Reimplemented from ObjectSegmentationFrame.

Definition at line 498 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::startActionServer ( ros::NodeHandle node_handle  ) 

Definition at line 167 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::stopActionServer (  ) 

Definition at line 186 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::stopSegmentation (  )  [protected]

Definition at line 348 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::update ( float  wall_dt,
float  ros_dt 
) [virtual]

Definition at line 369 of file object_segmentation_rviz_ui.cpp.

void bosch_object_segmentation_gui::ObjectSegmentationRvizUI::updateImageOverlay (  )  [private]

Definition at line 416 of file object_segmentation_rviz_ui.cpp.


Member Data Documentation

Definition at line 172 of file object_segmentation_rviz_ui.h.

Point clusters

Definition at line 175 of file object_segmentation_rviz_ui.h.

Definition at line 169 of file object_segmentation_rviz_ui.h.

Definition at line 166 of file object_segmentation_rviz_ui.h.

Definition at line 167 of file object_segmentation_rviz_ui.h.

Definition at line 165 of file object_segmentation_rviz_ui.h.

The current marker being published.

Definition at line 182 of file object_segmentation_rviz_ui.h.

Definition at line 168 of file object_segmentation_rviz_ui.h.

Definition at line 120 of file object_segmentation_rviz_ui.h.

Publishing images (for debug only).

Definition at line 137 of file object_segmentation_rviz_ui.h.

Publisher for markers.

Definition at line 178 of file object_segmentation_rviz_ui.h.

The node handle.

Definition at line 131 of file object_segmentation_rviz_ui.h.

Used to remember the number of markers we publish so we can delete them later.

Definition at line 180 of file object_segmentation_rviz_ui.h.

Definition at line 124 of file object_segmentation_rviz_ui.h.

Definition at line 159 of file object_segmentation_rviz_ui.h.

The node handle.

Definition at line 134 of file object_segmentation_rviz_ui.h.

Definition at line 115 of file object_segmentation_rviz_ui.h.

Definition at line 117 of file object_segmentation_rviz_ui.h.

Definition at line 118 of file object_segmentation_rviz_ui.h.

Definition at line 162 of file object_segmentation_rviz_ui.h.

Definition at line 114 of file object_segmentation_rviz_ui.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Friends


bosch_object_segmentation_gui
Author(s): Benjamin Pitzer
autogenerated on Tue Mar 5 13:41:30 2013