$search

ActiveRealTimeSegmenter Class Reference

ROS Node class. More...

List of all members.

Public Member Functions

 ActiveRealTimeSegmenter ()
 Constructor.
void execute (int loops)
 Execute Segmentation.
 ~ActiveRealTimeSegmenter ()
 Destructor.

Private Member Functions

bool assembleSensorData (sensor_msgs::Image::ConstPtr &recent_image, stereo_msgs::DisparityImage::ConstPtr &recent_disparity_image, ros::Duration time_out)
 Read sensor data from topics.

Private Attributes

ros::NodeHandle nh_
 The node handle.

Detailed Description

ROS Node class.

Definition at line 22 of file dosegment_node.cpp.


Constructor & Destructor Documentation

ActiveRealTimeSegmenter::ActiveRealTimeSegmenter (  )  [inline]

Constructor.

Definition at line 26 of file dosegment_node.cpp.

ActiveRealTimeSegmenter::~ActiveRealTimeSegmenter (  )  [inline]

Destructor.

Definition at line 32 of file dosegment_node.cpp.


Member Function Documentation

bool ActiveRealTimeSegmenter::assembleSensorData ( sensor_msgs::Image::ConstPtr recent_image,
stereo_msgs::DisparityImage::ConstPtr recent_disparity_image,
ros::Duration  time_out 
) [private]

Read sensor data from topics.

Read sensor data from topics and store

Parameters:
recent_image Storage for image sensor_msg
recent_disparity_image Storage for disparity image
time_out How long it is tried to get data

Definition at line 58 of file dosegment_node.cpp.

void ActiveRealTimeSegmenter::execute ( int  loops  ) 

Execute Segmentation.

Parameters:
loops how many loops should segmentation run

Definition at line 91 of file dosegment_node.cpp.


Member Data Documentation

The node handle.

Definition at line 55 of file dosegment_node.cpp.


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


active_realtime_segmentation
Author(s): Mårten Björkman. Maintained by Jeannette Bohg
autogenerated on Tue Mar 5 14:01:56 2013