Wiki

  Show EOL distros: 

toposens: toposens_bringup | toposens_description | toposens_driver | toposens_markers | toposens_msgs | toposens_pointcloud | toposens_sync

Package Summary

ROS device driver for communication with TS sensors.

toposens: toposens_bringup | toposens_description | toposens_driver | toposens_echo_driver | toposens_markers | toposens_msgs | toposens_pointcloud | toposens_sync

Package Summary

ROS device driver for communication with TS sensors.

toposens: toposens_bringup | toposens_description | toposens_driver | toposens_echo_driver | toposens_markers | toposens_msgs | toposens_pointcloud | toposens_sync

Package Summary

ROS device driver for communication with TS sensors.

Overview

This package functions as a device driver for a Toposens 3D ultrasonic sensor. It can be used to setup a serial connection to the sensor, parse the received data string and publish it as a toposens_msgs/TsScan.

ROS Nodes

ts_driver_node

translates the raw datastream of a Toposens 3D ultrasonic sensor into messages of type toposens_msgs/TsScan

Published Topics

ts_scans (toposens_msgs/TsScan)

Parameters

~port (std_msgs/String) ~frame_id (std_msgs/String) ~echo_rejection_threshold (int) ~noise_indicator_threshold (int) ~num_pulses (int) ~peak_detection_window (int) ~external_temperature (double) ~use_external_temperature (bool)

Most of the parameters are used by the sensors firmware and are therefore sent to the sensor via the serial port. For a more detailed description of these parameters see this tutorial.

Wiki: toposens_driver (last edited 2019-11-18 16:11:52 by SebastianDengler)