ROS Software Maintainer: ROBOTIS
ROBOTIS e-Manual
ROS API
op3_ball_detector
Subscribed Topics
~/enable (std_msgs/Bool)- OP3 will start searching for a ball with a True message, and stop with a False message.
- The message in this topic contains camera input image for ball searching.
- The message in this topic contains camera information of the corresponding input image.
Published Topics
~/image_out (sensor_mgsg/Image)- The message in this topic contains an output image after the ball searching process.
- The message in this topic contains camera information of the output image.
- Detected ball information
header(std_msgs/Header) : Header information
circles(geometry_msgs/Point[]) : Detecetd balls
- x X coordinate of the center of ball in the image coordinate system
- y Y coordinate of the center of ball in the image coordinate system
- z Radius of the detected ball
Parameters
/yaml_path (string, default: "")- The path of the yaml file that saves parameters.
- Size of Gaussian Blur Kernel (only odd value is possible.)
- standard deviation of Gaussian Blur
- Threshold of the edge detector
- Resolution of the Hough accumulator, in terms of inverse ratio of image resolution
- Minimum distance between circles
- Accumulator threshold to decide center detection
- Minimum circle radius allowed, pixels. (if unknown, put 0 for a detault.)
- Maximum circle radius allowed, pixels. (if unknown, put 0 for a detault.)
- Minimum threshold of H filter
- Maximum threshold of H filter
- Minimum threshold of S filter
- Maximum threshold of S filter
- Minimum threshold of V filter
- Maximum threshold of V filter
- Show filtered image to debug