Only released in EOL distros:
Package Summary
Particle plume is a odor mapping algorithm based on the PCL allowing for a 3D representation of a chemical plume by means of a 3D point cloud.
- Author: Gonçalo Cabrita and Pedro Sousa
- License: BSD
- Source: svn http://isr-uc-ros-pkg.googlecode.com/svn/stacks/odor_search/trunk
Contents
Overview
Particle Plume is a 3D odor mapping algorithm. It intends to tackle the problems of plume intermittence, gas sensor noise and chemical data sharing between robots when applicable.
Particle Plume represents plumes as point clouds using PCL. A grid of visited cells us also generated, allowing to distinguish between visited locations with no odor present and locations which were not yet visited.
ROS API
particle_plume_node
particle_plume_node is a 3D odor mapping algorithm.Subscribed Topics
nose (lse_sensor_msgs/Nostril)- Gas sensor messages.
Published Topics
plume (sensor_msgs/PointCloud2)- The odor plume.
- Visited cells.
Parameters
~global_frame_id (string, default: map)- The global frame id.
- The radius of the bubble in meters inside which particles are generated for any given gas sensor reading.
- The maximum number of particles generated inside a bubble, represents the maximum value given by the gas sensor.
- The time before each particle is removed after creation in minutes. 0 means the particle is never removed.
- The frequency at which the plume and the visited cells are published in Hz.
- Visited cell size. Should be equal to the navigation map cell size.
- The sensor model being used to generate the plume.
Tutorials
Coming soon...