Show EOL distros:
turtlebot3_applications: turtlebot3_automatic_parking | turtlebot3_automatic_parking_vision | turtlebot3_follow_filter | turtlebot3_follower | turtlebot3_panorama
Package Summary
Released
Documented
This app utilises pano_ros for taking snapshots and stitching them together to create panorama pictures.
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Younghun Ju, Jihoon Lee, Marcus Liebhardt, Christopher Tatsch
- License: BSD
- 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
This app utilises pano_ros for taking snapshots and stitching them together to create panorama pictures.
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Younghun Ju, Jihoon Lee, Marcus Liebhardt, Christopher Tatsch
- License: BSD
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/turtlebot3_applications/issues
- Source: git https://github.com/ROBOTIS-GIT/turtlebot3_applications.git (branch: melodic-devel)
Contents
ROS Software Maintainer: ROBOTIS
ROBOTIS e-Manual
ROS API
turtlebot3_panorama
This package is used turtlebot_panorama.Subscribed Topics
odom (nav_msgs/Odometry)- Contains the Turtlebot3’s odometry information based on the encoder and IMU.
- This Topic contains an uncompressed image (0, 0) is at top-left corner of image.
Published Topics
cmd_vel (geometry_msgs/Twist)- Control the translational and rotational speed of the robot unit in m/s, rad/s.
- publishes the stitched image with ImageTransport
raspicam_node
This package is used raspicam.Published Topics
camera_info (sensor_msgs/CameraInfo)- Topic that defines meta information for a camera.
- Topic contains a compressed image.
republish
This package is used ImageTransport.Subscribed Topics
image/compressed (sensor_msgs/CompressedImage)- Topic contains a compressed image.
Published Topics
camera/rgb/image_raw (sensor_msgs/Image)- This Topic contains an uncompressed image (0, 0) is at top-left corner of image.