Wiki

Only released in EOL distros:  

pal_image_processing: pal_vision_segmentation

Package Summary

This package provides segmentation nodes based on various techniques.
Masked image or mask provided, and can be tuned via dynamic_reconfigure.

pal_image_processing: pal_vision_segmentation

Package Summary

This package provides segmentation nodes based on various techniques.
Masked image or mask provided, and can be tuned via dynamic_reconfigure.

Package Summary

The pal_vision_segmentation package provides segmentation nodes based on various techniques. Masked image or mask is provided, and can be tuned via dynamic_reconfigure.

pal_logo.png

Overview

Segmenting regions of interest in images is a wide field in Computer Vision and Image Processing. Some methods include a kind of pre-segmentation inside but there are some which can be boosted using masks on the image or masked images. In this package we provide ROS nodes to help with this image processing step. disparity_k.jpg histogram_segmentation_orange_ball_k.png

ROS API

disparity_segmentation

Provides distance-based segmentation based on a disparity image computed using stereo cameras.

Subscribed Topics

disparity_image (stereo_msgs/DisparityImage) image (sensor_msgs/Image) camera_info (sensor_msgs/CameraInfo)

Published Topics

image_masked (sensor_msgs/Image) camera_info (sensor_msgs/CameraInfo) mask (sensor_msgs/Image)

histogram_segmentation

Given a single image of the target object it provides histogram backprojection-based segmentation on a color image.

Subscribed Topics

image (sensor_msgs/Image)

Published Topics

image_masked (sensor_msgs/Image) mask (sensor_msgs/Image)

template_segmentation

Given a single image of the target object it provides template matching-based segmentation on a color image.

Subscribed Topics

image (sensor_msgs/Image)

Published Topics

image_masked (sensor_msgs/Image) mask (sensor_msgs/Image)

Wiki: pal_vision_segmentation (last edited 2012-06-28 16:21:06 by BenceMagyar)