Sensors namespace. More...
Classes | |
class | AirPressureSensor |
AirPressure Sensor Class. More... | |
class | AltimeterSensor |
Altimeter Sensor Class. More... | |
class | BoundingBoxCameraSensor |
BoundingBox camera sensor class. More... | |
class | BrownDistortionModel |
Brown Distortion Model class. More... | |
class | CameraSensor |
Camera Sensor Class. More... | |
class | DepthCameraSensor |
Depth camera sensor class. More... | |
class | Distortion |
Distortion models for sensor output signals. More... | |
class | DistortionFactory |
Use this distortion manager for creating and loading distortion models. More... | |
class | ForceTorqueSensor |
Force Torque Sensor Class. More... | |
class | GaussianNoiseModel |
Gaussian noise class. More... | |
class | GpuLidarSensor |
GpuLidar Sensor Class. More... | |
class | ImageBrownDistortionModel |
Distortion Model class for image sensors. More... | |
class | ImageDistortionFactory |
Use this distortion manager for creating and loading distortion models. More... | |
class | ImageGaussianNoiseModel |
Gaussian noise class for image sensors. More... | |
class | ImageNoiseFactory |
class | ImuSensor |
Imu Sensor Class. More... | |
class | Lidar |
Lidar Sensor Class. More... | |
class | LogicalCameraSensor |
Logical Camera Sensor Class. More... | |
class | MagnetometerSensor |
Magnetometer Sensor Class. More... | |
class | Manager |
Loads and runs sensors. More... | |
class | NavSatSensor |
NavSat Sensor Class. More... | |
class | Noise |
Noise models for sensor output signals. More... | |
class | NoiseFactory |
Use this noise manager for creating and loading noise models. More... | |
class | RenderingEvents |
class | RenderingSensor |
a rendering sensor class More... | |
class | RgbdCameraSensor |
RGBD camera sensor class. More... | |
class | SegmentationCameraSensor |
Segmentation camera sensor class. More... | |
class | Sensor |
a base sensor class More... | |
class | SensorFactory |
A factory class for creating sensors This class instantiates sensor objects based on the sensor type and makes sure they're initialized correctly. More... | |
class | SensorPlugin |
Base sensor plugin interface. More... | |
class | SensorTypePlugin |
Templated class for instantiating sensors of the specified type. More... | |
class | ThermalCameraSensor |
Thermal camera sensor class. More... | |
Typedefs | |
typedef std::shared_ptr< BrownDistortionModel > | BrownDistortionModelPtr |
typedef std::vector< CameraSensorPtr > | CameraSensor_V |
typedef std::shared_ptr< CameraSensor > | CameraSensorPtr |
typedef std::shared_ptr< Distortion > | DistortionPtr |
typedef std::shared_ptr< GaussianNoiseModel > | GaussianNoiseModelPtr |
typedef std::vector< GpuLidarSensorPtr > | GpuLidarSensor_V |
typedef std::shared_ptr< GpuLidarSensor > | GpuLidarSensorPtr |
typedef std::shared_ptr< ImageBrownDistortionModel > | ImageBrownDistortionModelPtr |
typedef std::shared_ptr< ImageGaussianNoiseModel > | ImageGaussianNoiseModelPtr |
Shared pointer to Noise. More... | |
typedef std::shared_ptr< Noise > | NoisePtr |
typedef std::vector< SensorPtr > | Sensor_V |
using | SensorId = std::size_t |
A string used to identify a sensor. More... | |
typedef std::shared_ptr< Sensor > | SensorPtr |
Functions | |
std::string | customType (const sdf::Sensor &_sdf) |
Get the name of a sensor's custom type from SDF. More... | |
std::string | customType (sdf::ElementPtr _sdf) |
Get the name of a sensor's custom type from SDF. More... | |
Variables | |
const SensorId | NO_SENSOR = 0 |
Detailed Description
Sensors namespace.
Typedef Documentation
◆ BrownDistortionModelPtr
◆ CameraSensor_V
typedef std::vector<CameraSensorPtr> CameraSensor_V |
◆ CameraSensorPtr
typedef std::shared_ptr<CameraSensor> CameraSensorPtr |
◆ DistortionPtr
typedef std::shared_ptr<Distortion> DistortionPtr |
◆ GaussianNoiseModelPtr
◆ GpuLidarSensor_V
typedef std::vector<GpuLidarSensorPtr> GpuLidarSensor_V |
◆ GpuLidarSensorPtr
◆ ImageBrownDistortionModelPtr
◆ ImageGaussianNoiseModelPtr
Shared pointer to Noise.
◆ NoisePtr
typedef std::shared_ptr<Noise> NoisePtr |
◆ Sensor_V
typedef std::vector<SensorPtr> Sensor_V |
◆ SensorId
using SensorId = std::size_t |
A string used to identify a sensor.
◆ SensorPtr
typedef std::shared_ptr<Sensor> SensorPtr |
Enumeration Type Documentation
◆ DistortionType
|
strong |
◆ NoiseType
|
strong |
◆ SensorCategory
enum SensorCategory |
SensorCategory is used to categorize sensors. This is used to put sensors into different threads.
Enumerator | |
---|---|
IMAGE | Image based sensor class. This type requires the rendering engine. |
RAY | Ray based sensor class. |
OTHER | A type of sensor is not a RAY or IMAGE sensor. |
CATEGORY_COUNT | Number of Sensor Categories. |
◆ SensorDistortionType
enum SensorDistortionType |
Enumerator | |
---|---|
SENSOR_DISTORTION_TYPE_BEGIN | |
NO_DISTORTION | Noise streams for the Camera sensor.
|
CAMERA_DISTORTION | Noise streams for the Camera sensor.
|
SENSOR_DISTORTION_TYPE_END |
◆ SensorNoiseType
enum SensorNoiseType |
Enumerator | |
---|---|
SENSOR_NOISE_TYPE_BEGIN | |
NO_NOISE | Noise streams for the Camera sensor.
|
CAMERA_NOISE | Noise streams for the Camera sensor.
|
MAGNETOMETER_X_NOISE_TESLA | Magnetometer body-frame X axis noise in Tesla.
|
MAGNETOMETER_Y_NOISE_TESLA | Magnetometer body-frame Y axis noise in Tesla.
|
MAGNETOMETER_Z_NOISE_TESLA | Magnetometer body-frame Z axis noise in Tesla.
|
ALTIMETER_VERTICAL_POSITION_NOISE_METERS | Vertical noise stream for the altimeter sensor.
|
ALTIMETER_VERTICAL_VELOCITY_NOISE_METERS_PER_S | Velocity noise streams for the altimeter sensor.
|
AIR_PRESSURE_NOISE_PASCALS | Air Pressure noise streams for the air pressure sensor.
|
ACCELEROMETER_X_NOISE_M_S_S | Accelerometer body-frame X axis noise in m/s^2.
|
ACCELEROMETER_Y_NOISE_M_S_S | Accelerometer body-frame Y axis noise in m/s^2.
|
ACCELEROMETER_Z_NOISE_M_S_S | Accelerometer body-frame Z axis noise in m/s^2.
|
GYROSCOPE_X_NOISE_RAD_S | Gyroscope body-frame X axis noise in m/s^2.
|
GYROSCOPE_Y_NOISE_RAD_S | Gyroscope body-frame X axis noise in m/s^2.
|
GYROSCOPE_Z_NOISE_RAD_S | Gyroscope body-frame X axis noise in m/s^2.
|
LIDAR_NOISE | Noise streams for the Lidar sensor.
|
FORCE_X_NOISE_N | Force body-frame X axis noise in N.
|
FORCE_Y_NOISE_N | Force body-frame Y axis noise in N.
|
FORCE_Z_NOISE_N | Force body-frame Z axis noise in N.
|
TORQUE_X_NOISE_N_M | Torque body-frame X axis noise in Nm.
|
TORQUE_Y_NOISE_N_M | Torque body-frame Y axis noise in Nm.
|
TORQUE_Z_NOISE_N_M | Torque body-frame Z axis noise in Nm.
|
NAVSAT_HORIZONTAL_POSITION_NOISE | Noise streams for the NavSat position sensor.
|
NAVSAT_VERTICAL_POSITION_NOISE | Noise streams for the NavSat position sensor.
|
NAVSAT_HORIZONTAL_VELOCITY_NOISE | Noise streams for the NavSat velocity sensor.
|
NAVSAT_VERTICAL_VELOCITY_NOISE | Noise streams for the NavSat velocity sensor.
|
SENSOR_NOISE_TYPE_END |
◆ WorldFrameEnumType
|
strong |
Inline bracket to help doxygen filtering.
Reference frames enum
Function Documentation
◆ customType() [1/2]
std::string ignition::sensors::customType | ( | const sdf::Sensor & | _sdf | ) |
Get the name of a sensor's custom type from SDF.
Given an SDF tag as follows:
<sensor name="sensor_name" type="custom" ignition:type="sensor_type">
This function returns sensor_type
.
It will return an empty string if the element is malformed. For example, if it misses the ignition:type
attribute or is not of type="custom"
.
- Parameters
-
[in] _sdf Sensor SDF object.
- Returns
- _sensorType Name of sensor type.
◆ customType() [2/2]
std::string ignition::sensors::customType | ( | sdf::ElementPtr | _sdf | ) |
Get the name of a sensor's custom type from SDF.
Given an SDF tag as follows:
<sensor name="sensor_name" type="custom" ignition:type="sensor_type">
This function returns sensor_type
.
It will return an empty string if the element is malformed. For example, if it misses the ignition:type
attribute or is not of type="custom"
.
- Parameters
-
[in] _sdf Sensor SDF object.
- Returns
- _sensorType Name of sensor type.
Variable Documentation
◆ NO_SENSOR
const SensorId NO_SENSOR = 0 |
Referenced by Manager::CreateSensor().