Only released in EOL distros:  

lse_sensor_network: sensornet

Package Summary

This package contains a node for connecting to the LSE SensorNet, a sensor network for monitoring odor and wind environmental data during odor search experiments.

Supported Hardware

The sensornet package was designed specifically for the SensorNet sensor and actuator nodes developed at LSE. The SensorNet nodes communicate over RS485, all the nodes included in this package assume a Devantech USB-RS485 converter is being used to make the bridge between a computer running ROS and the SensorNet.

ROS API

sensornet_node

sensornet_node is the node responsible for publishing the data recovered from the SensorNet nodes.

Published Topics

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

Parameters

sensornet/port (string, default: /dev/ttyUSB0)
  • The port where the USB-RS485 device can be found.

scan_nodes

Node discover tool.

Parameters

sensornet/port (string, default: /dev/ttyUSB0)
  • The port where the USB-RS485 device can be found.

set_address

Tool that allows changing the address of a node. Very handy for newly built nodes.

Parameters

sensornet/port (string, default: /dev/ttyUSB0)
  • The port where the USB-RS485 device can be found.

set_sensors

Tools that allows to change the sensors connected to a node. Very handy for newly built nodes.

Parameters

sensornet/port (string, default: /dev/ttyUSB0)
  • The port where the USB-RS485 device can be found.

SensorNet Node Source Code and Schematics

Coming soon...

Communication Protocol Documentation

The SensorNet protocol is described in sensornet_protocol.pdf.

Wiki: sensornet (last edited 2010-11-30 17:35:18 by Gonçalo Cabrita)