toposens: toposens_bringup | toposens_description | toposens_driver | toposens_echo_driver | toposens_markers | toposens_msgs | toposens_pointcloud | toposens_sync
Package Summary
Released
Documented
ROS device driver for communication with TS ECHO sensors on a CAN bus
- Maintainer status: developed
- Maintainer: Dennis Maier <maier AT toposens DOT com>, Baris Yazici <yazici AT toposens DOT com>
- Author: Tobias Roth <roth AT toposens DOT com>, Dennis Maier <maier AT toposens DOT com>, Baris Yazici <yazici AT toposens DOT com>
- License: BSD 3-Clause
- External website: https://toposens.com
- Bug / feature tracker: https://gitlab.com/toposens/public/ros-packages/issues
- Source: git https://gitlab.com/toposens/public/ros-packages.git (branch: master)
toposens: toposens_bringup | toposens_description | toposens_driver | toposens_echo_driver | toposens_markers | toposens_msgs | toposens_pointcloud | toposens_sync
Package Summary
Released
Documented
ROS device driver for communication with TS ECHO sensors on a CAN bus
- Maintainer status: developed
- Maintainer: Dennis Maier <maier AT toposens DOT com>, Baris Yazici <yazici AT toposens DOT com>
- Author: Tobias Roth <roth AT toposens DOT com>, Dennis Maier <maier AT toposens DOT com>, Baris Yazici <yazici AT toposens DOT com>
- License: BSD 3-Clause
- External website: https://toposens.com
- Bug / feature tracker: https://gitlab.com/toposens/public/ros-packages/issues
- Source: git https://gitlab.com/toposens/public/ros-packages.git (branch: master)
Contents
Overview
This package contains nodes to enable the use of Toposens ECHO ONE sensor within ROS. Data will be published as toposens_msgs/TsScan.
ROS Nodes
toposens_echo_driver_node
Communicates with the Toposens Sensor Library and publishes ECHO ONE point clouds as toposens_msgs/TsScan.Published Topics
ts_scans (toposens_msgs/TsScan)- Point cloud with additional header information and XYZIC points (x, y, z, intensity, confidence).
Parameters
~com_interface (std_msgs/String)- whether to use CAN or UART connection for ECHO ONE
- CAN interface to use
- UART port to use
- Spin rate of the ros node (for single shot mode)
- Topic to publish point cloud to.
- Run the sensor in single-shot or continuous mode (options: [single_shot, continuous]).
- Base frame ID in which the data is published.
- Point cloud will be published with this prefix (e.g. toposens_ + sensor ID)
- Wait until transforms are available.
- When using single sensor the ID can be omitted in the published transform between sensor-frame and toposens-base-link
- Restart node again if it crashes.
- Configure the sensor at startup with values from the parameter yaml file.
- Transducer amplitude (percentage)
- Electrical pulses that the piezo transmitter is stimulated with in every transmission cycle.
- Threshold to filter noise during signal processing on sensor.
- Deprecated filter on sensor to determine echo quality. Set to 100 to disable.
- Environment temperature used for speed of sound calculations.
- Adds sleep after each measurement in ROS node. [experimental]
- Activate the sensor's near field detection. [experimental]
- Parameter for near field detection. [experimental]
- Mark frames as noisy based on sensor noise level. [experimental]
- Dynamically adjust signal amplification to avoid clipping or too quiet echoes.
request_adc_dump
Service to request adc dump from sensor.Parameters
sensor_id (std_msgs/String)- ID of the sensor to request the dump from.
- File path to save the ADC dump to.