Skip to main content
Version: ROS 1 Noetic

Overview

Introduction

The Robot Customizer ROS package by Clearpath Robotics provides an easy-to-use interface for adding sensors to your robot in the real world or in simulation. The usage interface consists of environment variables which can be set to add sensors visually to your robot's model, as well as to enable the launching of the sensors' respective drivers.

The sensors supported in this package are commonly used by Clearpath Robotics to customize mobile robotic platforms.

The example files used throughout this tutorial can be found here.

Supported Sensors and Environment Variables

Below is a list of sensors currently supported by the Robot Customizer ROS package, as well as the configurable environment variables for each sensor.

2D Lasers

  • SICK LMS1xx Series
  • Hokuyo UST-10LX
Environment VariablesDefault ValuesOther ValuesDescription
CPR_LASER01Enable/disable sensor
CPR_LASER_MODELlms1xxust10Desired sensor model
CPR_LASER_PARENTbase_linkAny linkMount link for sensor
CPR_LASER_TOPICscanAny topicROS topic for sensor data
CPR_LASER_XYZ"0 0 0"Any XYZPosition of sensor
CPR_LASER_RPY"0 0 0"Any RPYOrientation of sensor
CPR_LASER_IP192.168.131.20Any IPIP address of sensor

3D Lasers

  • Velodyne VLP-16
  • Velodyne HDL-32E
Environment VariablesDefault ValuesOther ValuesDescription
CPR_LASER_3D01Enable/disable sensor
CPR_LASER_3D_MODELvlp16hdl32eDesired sensor model
CPR_LASER_3D_PARENTbase_linkAny linkMount link for sensor
CPR_LASER_3D_TOPICscanAny topicROS topic for sensor data
CPR_LASER_3D_XYZ"0 0 0"Any XYZPosition of sensor
CPR_LASER_3D_RPY"0 0 0"Any RPYOrientation of sensor
CPR_LASER_3D_IP192.168.131.20Any IPIP address of sensor

GPS

  • NovAtel SMART7
  • Garmin 18x
Environment VariablesDefault ValuesOther ValuesDescription
CPR_GPS01Enable/disable sensor
CPR_GPS_MODELsmart718xDesired sensor model
CPR_GPS_PARENTbase_linkAny linkMount link for sensor
CPR_GPS_XYZ"0 0 0"Any XYZPosition of sensor
CPR_GPS_RPY"0 0 0"Any RPYOrientation of sensor
CPR_GPS_PORT/dev/clearpath/gpsAny portName of sensor device port
CPR_GPS_BAUD57600Any baud rateBaud rate of sensor

IMU

  • LORD MicroStrain GX3 Series
  • LORD MicroStrain GX4 Series
  • LORD MicroStrain GX5 Series
  • LORD MicroStrain CX3 Series
  • LORD MicroStrain RQ1 Series
  • LORD MicroStrain GQ7 Series
Environment VariablesDefault ValuesOther ValuesDescription
CPR_MICROSTRAIN01Enable/disable sensor
CPR_MICROSTRAIN_PARENTbase_linkAny linkMount link for sensor
CPR_MICROSTRAIN_XYZ"0 0 0"Any XYZPosition of sensor
CPR_MICROSTRAIN_RPY"0 0 0"Any RPYOrientation of sensor
CPR_MICROSTRAIN_PORT/dev/microstrainAny portName of sensor device port

Cameras

  • Intel RealSense D400 Series
  • Intel RealSense L515
Environment VariablesDefault ValuesOther ValuesDescription
CPR_REALSENSE01Enable/disable sensor
CPR_REALSENSE_MODELd435d435i d415 d455 l515Desired sensor model
CPR_REALSENSE_PARENTbase_linkAny linkMount link for sensor
CPR_REALSENSE_TOPICrealsenseAny topicROS topic for sensor data
CPR_REALSENSE_XYZ"0 0 0"Any XYZPosition of sensor
CPR_REALSENSE_RPY"0 0 0"Any RPYOrientation of sensor

Arms

Coming soon!