Show EOL distros:
fiducials: aruco_detect | fiducial_msgs | fiducial_slam
Package Summary
Released
Documented
Fiducial detection based on the aruco library
- Maintainer status: developed
- Maintainer: Jim Vaughan <jimv AT mrjim DOT com>, Rohan Agrawal <send2arohan AT gmail DOT com>
- Author: Jim Vaughan <jimv AT mrjim DOT com>
- License: BSD
- Source: git https://github.com/UbiquityRobotics/fiducials.git (branch: kinetic-devel)
fiducials: aruco_detect | fiducial_msgs | fiducial_slam
Package Summary
Released
Documented
Fiducial detection based on the aruco library
- Maintainer status: developed
- Maintainer: Jim Vaughan <jimv AT mrjim DOT com>, Rohan Agrawal <send2arohan AT gmail DOT com>
- Author: Jim Vaughan <jimv AT mrjim DOT com>
- License: BSD
- Source: git https://github.com/UbiquityRobotics/fiducials.git (branch: kinetic-devel)
Package Summary
Released
No API documentation
Fiducial detection based on the aruco library
- Maintainer status: maintained
- Maintainer: Jim Vaughan <jimv AT mrjim DOT com>, Rohan Agrawal <send2arohan AT gmail DOT com>
- Author: Jim Vaughan <jimv AT mrjim DOT com>
- License: BSD
Nodes
aruco_detect
aruco_detect detects the pose of aruco markers.Subscribed Topics
/camera/compressed (sensor_msgs/CompressedImage)- The images to be processed.
- The intrinsic parameters of the camera used to acquire the images.
Published Topics
/fiducial_vertices (fiducial_msgs/Fiducials)- The vertices of detected fiducials.
- The transforms showing the pose of the fiducials relative to the camera.
Parameters
There are two categories of ROS Parameters that can be used to configure the aruco_detect node: general and detection.
General parameters
Parameters
~dictionary (int, default: 7 (DICT_5X5_1000))- The aruco dictionary to use. Possible values: 0 (DICT_4X4_50), 1 (DICT_4X4_100), 2 (DICT_4X4_250), 3 (DICT_4X4_1000), 4 (DICT_5X5_50), 5 (DICT_5X5_100), 6 (DICT_5X5_250), 7 (DICT_5X5_1000), 8 (DICT_6X6_50), 9 (DICT_6X6_100), 10 (DICT_6X6_250), 11 (DICT_6X6_1000), 12 (DICT_7X7_50), 13 (DICT_7X7_100), 14 (DICT_7X7_250), 15 (DICT_7X7_1000), 16 (DICT_ARUCO_ORIGINAL).
- The length of one side of a fiducial in meters, used by the pose estimation.
- A string expressing exceptions to fiducial_len. This can contain individual fiducial IDs, or ranges of them. Example: "1-10: 0.05, 12: 0.06" sets the length of fiducials 1 to 10 to 5cm and the length of fiducial 12 to 6cm.
- A string expressing fiducials to be ignored. This can contain individual fiducial IDs, or ranges of them. Example: "1-10, 12" ignores fiducials 1 to 10 and 12.
- If set, images will be published with the detected markers shown.
Detection parameters
The detector parameters used in the library are paramaters of the aruco_detect node. They can also be set via dynamic reconfigure.
~adaptiveThreshConstant (int, default: 7)
- Constant for adaptive thresholding before finding contours.
- Minimum window size for adaptive thresholding before finding contours.
- Maximum window size for adaptive thresholding before finding contours.
- Increments from adaptiveThreshWinSizeMin to adaptiveThreshWinSizeMax during the thresholding.
- Maximum number of iterations for stop criteria of the corner refinement process.
- Minimum error for the stop criteria of the corner refinement process.
- Minimum error for the stop criteria of the corner refinement process
- Whether to do supbixel corner refinement.
- Error correction rate respect to the maximum error correction capability for each dictionary.
- Minimum distance between corners for detected markers relative to its perimeter.
- Number of bits of the marker border, i.e. marker border width.
- Maximum number of accepted erroneous bits in the border (i.e. number of allowed white bits in the border).
- Minimum distance of any corner to the image border for detected markers (in pixels).
- minimum mean distance beetween two marker corners to be considered similar, so that the smaller one is removed. The rate is relative to the smaller perimeter of the two markers.
- Determine minumum perimeter for marker contour to be detected. This is defined as a rate respect to the maximum dimension of the input image.
- Determine maximum perimeter for marker contour to be detected. This is defined as a rate respect to the maximum dimension of the input image.
- Minimun standard deviation in pixels values during the decodification step to apply Otsu thresholding (otherwise, all the bits are set to 0 or 1 depending on mean higher than 128 or not).
- Width of the margin of pixels on each cell not considered for the determination of the cell bit. Represents the ratio with respect to the total size of the cell.
- Number of bits (per dimension) for each cell of the marker when removing the perspective.
- Number of bits (per dimension) for each cell of the marker when removing the perspective.