Wiki

  Show EOL distros: 

Package Summary

Interface driver for Omron OS32C Lidar via Ethernet/IP (Industrial Protocol)

  • Maintainer status: maintained
  • Maintainer: Rein Appeldoorn <rein AT ruvu DOT nl>
  • Author: Kareem Shehata <kareem AT shehata DOT ca>
  • License: BSD
  • Source: git https://github.com/ros-drivers/omron.git (branch: indigo-devel)

Package Summary

Interface driver for Omron OS32C Lidar via Ethernet/IP (Industrial Protocol)

  • Maintainer status: maintained
  • Maintainer: Rein Appeldoorn <rein AT eurogroep DOT com>
  • Author: Kareem Shehata <kareem AT shehata DOT ca>
  • License: BSD
  • Source: git https://github.com/ros-drivers/omron.git (branch: kinetic-devel)

Package Summary

Interface driver for Omron OS32C Lidar via Ethernet/IP (Industrial Protocol)

  • Maintainer status: maintained
  • Maintainer: Rein Appeldoorn <rein AT eurogroep DOT com>
  • Author: Kareem Shehata <kareem AT shehata DOT ca>
  • License: BSD
  • Source: git https://github.com/ros-drivers/omron.git (branch: kinetic-devel)

Package Summary

Interface driver for Omron OS32C Lidar via Ethernet/IP (Industrial Protocol)

  • Maintainer status: maintained
  • Maintainer: Rein Appeldoorn <rein AT eurogroep DOT com>
  • Author: Kareem Shehata <kareem AT shehata DOT ca>
  • License: BSD
  • Source: git https://github.com/ros-drivers/omron.git (branch: kinetic-devel)

os32c.jpg

Overview

This package provides a driver for the OMRON OS32C EtherNet/IP based safety laser. You can learn more about this device on the manufacturer's website:

https://www.ia.omron.com/products/family/2717/

The primary resource used in developing this driver was the OS32C with EtherNet/IP & Measurement Data Addendum.

Nodes

omron_os32c_driver

Standalone driver node that publishes the laserscan with diagnostics information.

Published Topics

scan (sensor_msgs/LaserScan)

Parameters

~host (string, default: 192.168.1.1) ~local_ip (string, default: 0.0.0.0) ~frame_id (string, default: laser) ~start_angle (double, default: OS32C::ANGLE_MAX) ~end_angle (double, default: OS32C::ANGLE_MIN) ~frequency (double, default: 12.856) ~expected_frequency (double, default: frequency) ~frequency_tolerance (double, default: 0.1) ~timestamp_min_acceptable (double, default: -1) ~timestamp_max_acceptable (double, default: -1) ~reconnect_timeout (double, default: 2.0) ~publish_intensities (bool, default: false)

Wiki: omron_os32c_driver (last edited 2019-06-19 12:25:24 by reinzor)