Show EOL distros:
turtlebot3_applications: turtlebot3_automatic_parking | turtlebot3_automatic_parking_vision | turtlebot3_follow_filter | turtlebot3_follower | turtlebot3_panorama
Package Summary
Released
Documented
Package for turtlebot3 automatic_parking. You need a reflective tape and real robots. You can see parking spot using this pacakge on rviz.
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Gilbert <kkjong AT robotis DOT com>
- 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)
turtlebot3_applications: turtlebot3_automatic_parking | turtlebot3_automatic_parking_vision | turtlebot3_follow_filter | turtlebot3_follower | turtlebot3_panorama
Package Summary
Released
Documented
Package for turtlebot3 automatic_parking. You need a reflective tape and real robots. You can see parking spot using this pacakge on rviz.
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Gilbert <kkjong AT robotis DOT com>
- 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
turtlebot3_autoparking
Subscribed Topics
scan (sensor_msgs/LaserScan)- Topic that confirms the scan values of the LiDAR mounted on the Turtlebot3.
- Contains the Turtlebot3’s odometry information based on the encoder and IMU.
Published Topics
cmd_vel (geometry_msgs/Twist)- Control the translational and rotational speed of the robot unit in m/s, rad/s.
- This topic represents points of parking spot's start and end from LiDAR mounted on the Turtlebot3.
- Reset Odometry and IMU Data. If you want to publish reset topic, type rostopic pub /reset std_msgs/Empty "{}".