Overview

This package provides the driver for the SICK safeVisionary2 cameras.

Installation

Please see the install instructions in the official Github repository.

ROS API

sick_safevisionary

Control node for the 3D camera. The node publishes to the following topics.

Published Topics

camera_info (sensor_msgs/CameraInfo)
  • General camera information
camera_io (sick_safevisionary_msgs/CameraIO)
  • Input output configurations and states
depth (sensor_msgs/Image)
  • Depth measurements
device_status (sick_safevisionary_msgs/DeviceStatus)
  • General camera status
fields (sick_safevisionary_msgs/FieldInformationArray)
  • Fields information
imu_data (sensor_msgs/Imu)
  • IMU measurements
intensity (sensor_msgs/Image)
  • Intensity measurements
points (sensor_msgs/PointCloud2)
  • The camera's point cloud measurements
region_of_interest (sick_safevisionary_msgs/ROIArray)
  • The regions of interest
state (sensor_msgs/Image)
  • The camera's pixel state map

Parameters

~frame_id (string, default: camera)
  • The frame_id of the published messages' header
~udp_port (int, default: 6060)
  • The udp port on which to receive data from the camera. Users need to configure this once for each device. See the install instructions.

Additional Information

You'll find additional information in the official Github repository.

Wiki: sick_safevisionary_driver (last edited 2023-11-27 13:03:06 by stefanscherzinger)