Newly supported apriltag_ros package
The April Robotics Lab's Github repository has a supported apriltag_ros package. The ROS Wiki documentation is here.
Only released in EOL distros:
Package Summary
ROS Wrapper for running the APRIL Tag detection system
- Author: Piyush Khandelwal
- License: Modified BSD
- Source: svn https://utexas-ros-pkg.googlecode.com/svn/trunk
Contents
Nodes
april.ros.TagPublisher
ROS Wrapper for publishing tags using the April Tag Detection LibrarySubscribed Topics
image_raw (sensor_msgs/Image)- Image stream to be used for tag detection
- Camera info message corresponding to the image stream
Published Topics
tags (april_msgs/TagPoseArray)- Tag information based on detected tags
- Rviz markers corresponding to detected tags
- Tag information published on the tf tree
Parameters
~tag_family (string, default: "april.tag.Tag36h11")- The family of tags to be detected
- Tag size (in meters) required to project the tag in 3d space. Different sizes for different tag ids are currently not supported.
- Use focal length values from the corresponding camera_info message or not
- Focal length in the x axis (in pixels). This value is used if ~use_camera_info is set to false
- Focal length in the y axis (in pixels). This values is used if ~use_camera_info is set to false. This value is typically equal to the focal length in the x axis.
- Publish visualizaion for easy tag display in rviz
- Magnify the size of the visualized tag by this amount to make visualization in rviz easier
- Broadcast detected tags on the tf tree. Nodes reading tag information from the tf tree can use this package interchangeably with the ar_pose package.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
- Detector parameter. See library documentation/research paper for more details.
Usage
Running the node directly (with default parameters)
rosrun april_tags_node execute
Using roslaunch
roslaunch april_tags_node april_tags_node.launch
Running rviz
rosrun rviz rviz -d `rospack find april_tags_node`/config/rviz.vcg
roslaunch april_tags_node rviz.launch
Report a Bug
This package just serves as a wrapper for the APRIL toolkit. If you detect a bug in the wrapper, please report it on the repository page(http://code.google.com/p/utexas-ros-pkg/issues/list). If you find a bug in the APRIL toolkit, please contact the original developers.