Show EOL distros:
Package Summary
TurtleBot3 AutoRace ROS package that controls Raspberry Pi Camera, and process the image
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Gilbert <kkjong AT robotis DOT com>, Leon Jung
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/turtlebot3_autorace/issues
- Source: git https://github.com/ROBOTIS-GIT/turtlebot3_autorace.git (branch: kinetic-devel)
Package Summary
TurtleBot3 AutoRace ROS package that controls Raspberry Pi Camera, and process the image
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Gilbert <kkjong AT robotis DOT com>
- Author: Gilbert <kkjong AT robotis DOT com>, Leon Jung
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/turtlebot3_autorace/issues
- Source: git https://github.com/ROBOTIS-GIT/turtlebot3_autorace.git (branch: melodic-devel)
Package Summary
TurtleBot3 AutoRace ROS package that controls Raspberry Pi Camera, and process the image
- Maintainer status: developed
- Maintainer: Ashe Kim <ashekim AT robotis DOT com>, Will Son <willson AT robotis DOT com>
- Author: Ashe Kim <ashekim AT robotis DOT com>, Ashe Kim
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/turtlebot3_autorace_2020/issues
- Source: git https://github.com/ROBOTIS-GIT/turtlebot3_autorace_2020.git (branch: master)
Contents
ROS Software Maintainer: ROBOTIS
ROBOTIS e-Manual
ROS API
image_compensation
Subscribed Topics
camera/image_input/compressed (sensor_msgs/CompressedImage)- Topic contains a compressed image
- This Topic contains an uncompressed image (0, 0) is at top-left corner of image
Published Topics
camera/image_output/compressed (sensor_msgs/CompressedImage)- Topic contains a compressed image
- This Topic contains an uncompressed image (0, 0) is at top-left corner of image
Dynamic Reconfigure
ImageCompensationParams.cfg :
#------------------------ parameter for image compensation ------------------------# gen.add("clip_hist_percent", double_t, 0, "Percentage of Histogram Cut-Off", 1.0, 0.0, 10.0)
image_projection
Subscribed Topics
camera/image_input/compressed (sensor_msgs/CompressedImage)- Topic contains a compressed image
- This Topic contains an uncompressed image (0, 0) is at top-left corner of image
Published Topics
camera/image_output/compressed (sensor_msgs/CompressedImage)- Topic contains a compressed image
- This Topic contains an uncompressed image (0, 0) is at top-left corner of image
Dynamic Reconfigure
ImageProjectionParams.cfg :
#-------------------------- parameter for image warping --------------------------# gen.add("top_x", int_t, 0, "Top X Pos", 60, 0, 120) gen.add("top_y", int_t, 0, "Top Y Pos", 50, 0, 120) gen.add("bottom_x", int_t, 0, "Bottom X Pos", 140, 0, 320) gen.add("bottom_y", int_t, 0, "Bottom Y Pos", 120, 0, 320)
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
Parameters
Refer to parameters for calibration with picamera. This package is provided parameters from .yaml files.
camera.yaml # default configuration for camera compensation.yaml # parameters for image compensation projection.yaml # parameters for image warping camerav2_320x240_30fps.yaml # default configuration for lense