Only released in EOL distros:  

odor_tools: odor_bar | virtual_nose

Package Summary

Odor bar node. Publishes a group of visualization_msgs/Marker as a bar for visually monitoring odor concentrations in rviz.

ROS API

odor_bar

odor_bar is a visualization tool that displays the current odor concentration by the means of a bar of visualization_msgs/Marker (cubes in this case). In a (near) future we expect to add this functionality for other data besides odor concentration.

Subscribed Topics

nose (lse_sensor_msgs/Nostril)
  • Chemical data from the MOX sensor(s).

Published Topics

odor_bars (visualization_msgs/Marker)
  • A set of markers (cubes) proportional to the received chemical data.

Parameters

~bar_frame_id (string, default: /base_link)
  • The frame_id of the odor bar. By default it moves with the robot.
~nose_frame_id (string, default: /base_nose)
  • The frame_id from the nostril to extract the data from.
~scale/x (float, default: 0.15)
  • The size of the x component of the cube.
~scale/y (float, default: 0.15)
  • The size of the y component of the cube.
~scale/z (float, default: 0.15)
  • The size of the z component of the cube.
~hsv_s (float, default: 1.0)
  • The S (saturation) component of the HSV color space. It should be constant.
~hsv_v (float, default: 1.0)
  • The V (value) component of the HSV color space. It should be constant.
~hue_max (float, default: 200.0)
  • The maximum value for H (hue) component of the HSV color space.
~hue_min (float, default: 0.0)
  • The minimum value for H (hue) component of the HSV color space.

Wiki: odor_bar (last edited 2010-12-02 17:28:20 by PedroSousa)