Show EOL distros:
Package Summary
PCL integration for TS sensors mounted on Turtlebot3.
- Maintainer status: developed
- Maintainer: Tobias Roth <roth AT toposens DOT com>
- Author: Adi Singh, Sebastian Dengler, Christopher Lang, Inshal Uddin
- License: BSD 3-Clause
- External website: https://toposens.com
- Source: git https://gitlab.com/toposens/public/ros-packages.git (branch: master)
Package Summary
PCL integration for TS sensors mounted on Turtlebot3.
- Maintainer status: developed
- Maintainer: Dennis Maier <maier AT toposens DOT com>, Baris Yazici <yazici AT toposens DOT com>
- Author: Adi Singh, Sebastian Dengler, Christopher Lang, Inshal Uddin
- License: BSD 3-Clause
- External website: https://toposens.com
- Source: git https://gitlab.com/toposens/public/ros-packages.git (branch: master)
Package Summary
PCL integration for TS sensors mounted on Turtlebot3.
- Maintainer status: developed
- Maintainer: Dennis Maier <maier AT toposens DOT com>, Baris Yazici <yazici AT toposens DOT com>
- Author: Adi Singh, Sebastian Dengler, Christopher Lang, Inshal Uddin
- License: BSD 3-Clause
- External website: https://toposens.com
- Source: git https://gitlab.com/toposens/public/ros-packages.git (branch: master)
Contents
Overview
This package enables conversion of messages of type toposens_msgs/TsScan into messages of type sensor_msgs/PointCloud2.
Surface Normals
Since version 2.0 the package makes use of the standard PointCloud type PointXYZINormal instead of the custom type TsPoint. As a result the PointCloud also contains information about the surface normals. |
Due to the specular reflection behavior of ultrasound, the surface normal of the detected object can be represented by a vector pointing from the detected point towards the sensor’s position while the point was recorded. This normal vector is added to the PointCloud representation. For a more detailed explanation of the physics behind Toposens sensors see Physics of 3D Ultrasonic Sensors.
ROS Nodes
ts_cloud_node
translates messages of type toposens_msgs/TsScan into messages of type sensor_msgs/PointCloud2. Also logs the PointCloud into a pcd file.Subscribed Topics
ts_scans (toposens_msgs/TsScan)- the scans that are published by the toposens_driver (name of the topic is a parameter)
Published Topics
ts_cloud (sensor_msgs/PointCloud2)- the PointCloud of type: PointXYZINormal that is created by accumulating the Toposens sensor data
- markers that visualize the the normal vectors of the points in the PointCloud
Parameters
~scans_topic (std_msgs/String)- topic name to listen for TsScan data
- frame ID in which the data is published
- interval after which PointCloud is stored to pcd file (set to zero for non logging the PointCloud)
- path where pcd file should be stored
- lifetime for markers that visualize normal vectors (set to zero for not publishing the markers)