SensorTypes.hh File Reference

Forward declarations and typedefs for sensors. More...

#include <vector>
#include <memory>
#include "gazebo/util/system.hh"
#include "gazebo/common/EnumIface.hh"

Go to the source code of this file.

Namespaces

namespace  gazebo
 Forward declarations for the common classes.
 
namespace  gazebo::sensors
 Sensors namespace.
 

Typedefs

typedef std::vector< AltimeterSensorAltimeterSensor_V
 
typedef std::shared_ptr< AltimeterSensorAltimeterSensorPtr
 
typedef std::vector< CameraSensorPtrCameraSensor_V
 
typedef std::shared_ptr< CameraSensorCameraSensorPtr
 
typedef std::vector< ContactSensorPtrContactSensor_V
 
typedef std::shared_ptr< ContactSensorContactSensorPtr
 
typedef std::vector< DepthCameraSensorPtrDepthCameraSensor_V
 
typedef std::shared_ptr< DepthCameraSensorDepthCameraSensorPtr
 
typedef std::shared_ptr< ForceTorqueSensorForceTorqueSensorPtr
 
typedef std::shared_ptr< GaussianNoiseModelGaussianNoiseModelPtr
 
typedef std::shared_ptr< GpsSensorGpsSensorPtr
 
typedef std::vector< GpuRaySensorPtrGpuRaySensor_V
 
typedef std::shared_ptr< GpuRaySensorGpuRaySensorPtr
 
typedef std::shared_ptr< ImageGaussianNoiseModelImageGaussianNoiseModelPtr
 Shared pointer to Noise.
 
typedef std::vector< ImuSensorPtrImuSensor_V
 
typedef std::shared_ptr< ImuSensorImuSensorPtr
 
typedef std::shared_ptr< LogicalCameraSensorLogicalCameraSensorPtr
 
typedef std::shared_ptr< MagnetometerSensorMagnetometerSensorPtr
 
typedef std::vector< MultiCameraSensorPtrMultiCameraSensor_V
 
typedef std::shared_ptr< MultiCameraSensorMultiCameraSensorPtr
 
typedef std::shared_ptr< NoiseNoisePtr
 
typedef std::vector< RaySensorPtrRaySensor_V
 
typedef std::shared_ptr< RaySensorRaySensorPtr
 
typedef std::vector< RFIDSensorRFIDSensor_V
 
typedef std::shared_ptr< RFIDSensorRFIDSensorPtr
 
typedef std::vector< RFIDTagRFIDTag_V
 
typedef std::shared_ptr< RFIDTagRFIDTagPtr
 
typedef std::vector< SensorPtrSensor_V
 
typedef std::shared_ptr< SensorSensorPtr
 
typedef std::shared_ptr< SonarSensorSonarSensorPtr
 
typedef std::shared_ptr< WideAngleCameraSensorWideAngleCameraSensorPtr
 
typedef std::vector< WirelessReceiverWirelessReceiver_V
 
typedef std::shared_ptr< WirelessReceiverWirelessReceiverPtr
 
typedef std::vector< WirelessTransceiverWirelessTransceiver_V
 
typedef std::shared_ptr< WirelessTransceiverWirelessTransceiverPtr
 
typedef std::vector< WirelessTransmitterWirelessTransmitter_V
 
typedef std::shared_ptr< WirelessTransmitterWirelessTransmitterPtr
 

Enumerations

enum  SensorCategory { IMAGE = 0 , RAY = 1 , OTHER = 2 , CATEGORY_COUNT = 3 }
 SensorCategory is used to categorize sensors. More...
 
enum  SensorNoiseType {
  SENSOR_NOISE_TYPE_BEGIN = 0 , NO_NOISE = SENSOR_NOISE_TYPE_BEGIN , CAMERA_NOISE = 1 , GPU_RAY_NOISE = 2 ,
  GPS_POSITION_LATITUDE_NOISE_METERS = 3 , GPS_POSITION_LONGITUDE_NOISE_METERS = 4 , GPS_POSITION_ALTITUDE_NOISE_METERS = 5 , GPS_VELOCITY_LATITUDE_NOISE_METERS = 6 ,
  GPS_VELOCITY_LONGITUDE_NOISE_METERS = 7 , GPS_VELOCITY_ALTITUDE_NOISE_METERS = 8 , RAY_NOISE = 9 , MAGNETOMETER_X_NOISE_TESLA = 10 ,
  MAGNETOMETER_Y_NOISE_TESLA = 11 , MAGNETOMETER_Z_NOISE_TESLA = 12 , ALTIMETER_POSITION_NOISE_METERS = 13 , ALTIMETER_VELOCITY_NOISE_METERS_PER_S = 14 ,
  IMU_ANGVEL_X_NOISE_RADIANS_PER_S = 15 , IMU_ANGVEL_Y_NOISE_RADIANS_PER_S = 16 , IMU_ANGVEL_Z_NOISE_RADIANS_PER_S = 17 , IMU_LINACC_X_NOISE_METERS_PER_S_SQR = 18 ,
  IMU_LINACC_Y_NOISE_METERS_PER_S_SQR = 19 , IMU_LINACC_Z_NOISE_METERS_PER_S_SQR = 20 , SENSOR_NOISE_TYPE_END
}
 

Detailed Description

Forward declarations and typedefs for sensors.