Wiki

leo_examples: leo_example_follow_ar_tag | leo_example_line_follower | leo_example_object_detection

Package Summary

Follow ARTag Example for Leo Rover.

Note: You can also check a detailed integration tutorial on LeoRover Tech - Follow ARTag

Overview

This package contains a ROS node which enables the Leo Rover to follow a printed ARTag.

It is one of a couple of packages made for showing an example usage of a stock Leo Rover.

Usage

To run the follower simply type:

roslaunch leo_example_follow_ar_tag follow_ar_tag.launch

It will use the base configuration from the yaml files. You can run the node with your configuration by changing the parameters (described in ROS API section)

ROS API

follow_ar_tag

Subscribed Topics

ar_pose_marker (ar_track_alvar_msgs/AlvarMarkers) wheel_odom_with_covariance (nav_msgs/Odometry)

Published Topics

cmd_vel (geometry_msgs/Twist)

Parameters

follow_id (int, default: 0) marker_timeout (float, default: 0.5) min_ang_vel (float, default: 0.1) max_ang_vel (float, default: 1.0) angle_min (float, default: 0.1) angle_max (float, default: 0.7) min_lin_vel_forward (float, default: 0.1) max_lin_vel_forward (float, default: 0.4) distance_min_forward (float, default: 0.7) distance_max_forward (float, default: 1.2) min_lin_vel_reverse (float, default: 0.1) max_lin_vel_reverse (float, default: 0.2) distance_max_reverse (float, default: 0.5) distance_min_reverse (float, default: 0.4)

Wiki: leo_example_follow_ar_tag (last edited 2022-07-04 15:16:04 by BlazejSowa)