Show EOL distros:
Package Summary
The follower demo was implemented using a 360 Laser Distance Sensor LDS-01. The classification algorithm is used based on previous fitting with samples of person and obstacles positions to take actions. It follows someone in front of the robot within a 50 centimeter range and 140 degrees.
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Gilbert <kkjong AT robotis DOT com>, Christopher Tatsch, Ashe Kim
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/turtlebot3_applications/issues
- Source: git https://github.com/ROBOTIS-GIT/turtlebot3_applications.git (branch: kinetic-devel)
Package Summary
The follower demo was implemented using a 360 Laser Distance Sensor LDS-01. The classification algorithm is used based on previous fitting with samples of person and obstacles positions to take actions. It follows someone in front of the robot within a 50 centimeter range and 140 degrees.
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Gilbert <kkjong AT robotis DOT com>, Christopher Tatsch, Ashe Kim
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/turtlebot3_applications/issues
- Source: git https://github.com/ROBOTIS-GIT/turtlebot3_applications.git (branch: melodic-devel)
ROS Software Maintainer: ROBOTIS
ROBOTIS e-Manual
ROS API
follower
Subscribed Topics
scan_filtered (sensor_msgs/LaserScan)- This topic is filtered scan topic from laser_filter package.
Published Topics
cmd_vel (geometry_msgs/Twist)- Control the translational and rotational speed of the robot unit in m/s, rad/s.