Functions
etsi_its_cam_msgs::access Namespace Reference

Functions

double getLateralAcceleration (const LateralAcceleration &lateral_acceleration)
 Get the lateral acceleration. More...
 
double getLateralAccelerationConfidence (const LateralAcceleration &lateral_acceleration)
 Get the Lateral Acceleration Confidence. More...
 
double getLongitudinalAcceleration (const LongitudinalAcceleration &longitudinal_acceleration)
 Get the longitudinal acceleration. More...
 
double getLongitudinalAccelerationConfidence (const LongitudinalAcceleration &longitudinal_acceleration)
 Get the Longitudinal Acceleration Confidence. More...
 
const std::array< double, 4 > getRefPosConfidence (const CAM &cam)
 Get the confidence ellipse of the reference position as Covariance matrix. More...
 
const std::array< double, 4 > getWGSRefPosConfidence (const CAM &cam)
 Get the confidence ellipse of the reference position as Covariance matrix. More...
 
void setItsPduHeader (CAM &cam, const uint32_t station_id, const uint8_t protocol_version=0)
 Set the ItsPduHeader-object for a CAM. More...
 
void setLateralAcceleration (LateralAcceleration &accel, const double value, const double confidence=std::numeric_limits< double >::infinity())
 Set the LateralAcceleration object. More...
 
void setLateralAccelerationValue (LateralAccelerationValue &accel, const double value)
 Set the LateralAccelerationValue object. More...
 
void setLongitudinalAcceleration (LongitudinalAcceleration &accel, const double value, const double confidence=std::numeric_limits< double >::infinity())
 Set the LongitudinalAcceleration object. More...
 
void setLongitudinalAccelerationValue (LongitudinalAccelerationValue &accel, const double value)
 Set the LongitudinalAccelerationValue object. More...
 
void setRefPosConfidence (CAM &cam, const std::array< double, 4 > &covariance_matrix, const double object_heading)
 Set the confidence of the reference position. More...
 
void setWGSRefPosConfidence (CAM &cam, const std::array< double, 4 > &covariance_matrix)
 Set the confidence of the reference position. More...
 

Function Documentation

◆ getLateralAcceleration()

double etsi_its_cam_msgs::access::getLateralAcceleration ( const LateralAcceleration &  lateral_acceleration)
inline

Get the lateral acceleration.

Parameters
lateralAccelerationto get the lateral acceleration from
Returns
lateral acceleration in m/s^2 as decimal number (left is positive)

Definition at line 63 of file cam_getters.h.

◆ getLateralAccelerationConfidence()

double etsi_its_cam_msgs::access::getLateralAccelerationConfidence ( const LateralAcceleration &  lateral_acceleration)
inline

Get the Lateral Acceleration Confidence.

Parameters
longitudinal_accelerationto get the LateralAccelerationConfidence from
Returns
double standard deviation of the lateral acceleration in m/s^2 as decimal number

Definition at line 73 of file cam_getters.h.

◆ getLongitudinalAcceleration()

double etsi_its_cam_msgs::access::getLongitudinalAcceleration ( const LongitudinalAcceleration &  longitudinal_acceleration)
inline

Get the longitudinal acceleration.

Parameters
longitudinalAccelerationto get the longitudinal acceleration from
Returns
longitudinal acceleration in m/s^2 as decimal number (accelerating is positive)

Definition at line 43 of file cam_getters.h.

◆ getLongitudinalAccelerationConfidence()

double etsi_its_cam_msgs::access::getLongitudinalAccelerationConfidence ( const LongitudinalAcceleration &  longitudinal_acceleration)
inline

Get the Longitudinal Acceleration Confidence.

Parameters
longitudinal_accelerationto get the LongitudinalAccelerationConfidence from
Returns
double standard deviation of the longitudinal acceleration in m/s^2 as decimal number

Definition at line 53 of file cam_getters.h.

◆ getRefPosConfidence()

const std::array<double, 4> etsi_its_cam_msgs::access::getRefPosConfidence ( const CAM &  cam)
inline

Get the confidence ellipse of the reference position as Covariance matrix.

The covariance matrix will have the entries cov_xx, cov_xy, cov_yx, cov_yy where x is the longitudinal axis and y is the lateral axis of the vehicle.

Parameters
camThe CAM message to get the reference position from
Returns
const std::array<double, 4> the covariance matrix, as specified above

Definition at line 88 of file cam_getters.h.

◆ getWGSRefPosConfidence()

const std::array<double, 4> etsi_its_cam_msgs::access::getWGSRefPosConfidence ( const CAM &  cam)
inline

Get the confidence ellipse of the reference position as Covariance matrix.

The covariance matrix will have the entries cov_xx, cov_xy, cov_yx, cov_yy where x is WGS84 North and y is East

Parameters
camThe CAM message to get the reference position from
Returns
const std::array<double, 4> the covariance matrix, as specified above

Definition at line 102 of file cam_getters.h.

◆ setItsPduHeader()

void etsi_its_cam_msgs::access::setItsPduHeader ( CAM &  cam,
const uint32_t  station_id,
const uint8_t  protocol_version = 0 
)
inline

Set the ItsPduHeader-object for a CAM.

Parameters
camCAM-Message to set the ItsPduHeader
station_id
protocol_version

Definition at line 45 of file cam_setters.h.

◆ setLateralAcceleration()

void etsi_its_cam_msgs::access::setLateralAcceleration ( LateralAcceleration &  accel,
const double  value,
const double  confidence = std::numeric_limits<double>::infinity() 
)
inline

Set the LateralAcceleration object.

AccelerationConfidence is set to UNAVAILABLE

Parameters
accelobject to set
valueLaterallAccelerationValue in m/s^2 as decimal number (left is positive)
confidencestandard deviation of the lateral acceleration in m/s^2 as decimal number Default is infinity, mapping to AccelerationConfidence::UNAVAILABLE

Definition at line 108 of file cam_setters.h.

◆ setLateralAccelerationValue()

void etsi_its_cam_msgs::access::setLateralAccelerationValue ( LateralAccelerationValue &  accel,
const double  value 
)
inline

Set the LateralAccelerationValue object.

Parameters
accelobject to set
valueLateralAccelerationValue in m/s^2 as decimal number (left is positive)

Definition at line 87 of file cam_setters.h.

◆ setLongitudinalAcceleration()

void etsi_its_cam_msgs::access::setLongitudinalAcceleration ( LongitudinalAcceleration &  accel,
const double  value,
const double  confidence = std::numeric_limits<double>::infinity() 
)
inline

Set the LongitudinalAcceleration object.

AccelerationConfidence is set to UNAVAILABLE

Parameters
accelobject to set
valueLongitudinalAccelerationValue in m/s^2 as decimal number (braking is negative)
confidencestandard deviation of the longitudinal acceleration in m/s^2 as decimal number Default is infinity, mapping to AccelerationConfidence::UNAVAILABLE

Definition at line 76 of file cam_setters.h.

◆ setLongitudinalAccelerationValue()

void etsi_its_cam_msgs::access::setLongitudinalAccelerationValue ( LongitudinalAccelerationValue &  accel,
const double  value 
)
inline

Set the LongitudinalAccelerationValue object.

Parameters
accelobject to set
valueLongitudinalAccelerationValue in m/s^2 as decimal number (braking is negative)

Definition at line 55 of file cam_setters.h.

◆ setRefPosConfidence()

void etsi_its_cam_msgs::access::setRefPosConfidence ( CAM &  cam,
const std::array< double, 4 > &  covariance_matrix,
const double  object_heading 
)
inline

Set the confidence of the reference position.

Parameters
camCAM-Message to set the confidence
covariance_matrixThe four values of the covariance matrix in the order: cov_xx, cov_xy, cov_yx, cov_yy The matrix has to be SPD, otherwise a std::invalid_argument exception is thrown. Its coordinate system is aligned with the object (x = longitudinal, y = lateral)
object_headingheading of the object in rad, with respect to WGS84

Definition at line 124 of file cam_setters.h.

◆ setWGSRefPosConfidence()

void etsi_its_cam_msgs::access::setWGSRefPosConfidence ( CAM &  cam,
const std::array< double, 4 > &  covariance_matrix 
)
inline

Set the confidence of the reference position.

Parameters
camCAM-Message to set the confidence
covariance_matrixThe four values of the covariance matrix in the order: cov_xx, cov_xy, cov_yx, cov_yy The matrix has to be SPD, otherwise a std::invalid_argument exception is thrown. Its coordinate system is WGS84 (x = North, y = East)

Definition at line 148 of file cam_setters.h.



etsi_its_msgs_utils
Author(s): Jean-Pierre Busch , Guido Küppers , Lennart Reiher
autogenerated on Sun May 18 2025 02:32:12