Only released in EOL distros:
Package Summary
Documented
Subscribe pcl data from laserscanner and transform it with tinkerforge imu orientation to new pcl
- Maintainer status: developed
- Maintainer: M. Fischer <fischerm AT htw-dresden DOT de>
- Author: M.Fischer
- License: MIT
- Source: git https://github.com/gus484/ros.git (branch: master)
Contents
ROS Node API
tinkerforge_laser_transform_node
This node transform the laser scanner point cloud with tinkerforge sensor data.Subscribed Topics
/cloud (sensor_msgs/PointCloud2)- Subscribe to laser scanner data for transformation.
Published Topics
/imu/data (sensor_msgs/Imu)- Publishes tinkerforge imu brick data.
- Publishes tinkerforge gps bricklet data.
- Publishes odometry data.
- Publishes tinkerforge magnetic field data (from imu).
- Publishes the transformed point cloud.
Parameters
~rate (int, default: 10)- Rate for the main loop.
- Title for the published IMU topic.
- Title for the published GPS topic.
- Title for the published Odometry topic.
- Title for the MagneticField topic.
- Enable IMU topic publish.
- Enable GPS topic publish.
- Enable Odometry topic publish.
- Enable MagneticField topic publish.
- Title for subscribed pcl data.
- Title for published and transformed pcl data.
- Define the sensor fusion in °/s.
- Define the laser pose x, y, z, yaw, pitch, roll in m and deg.