1 #ifndef NMEA_GPS_PLUGIN_GPS_SENSOR_MODEL_H_INCLUDED 2 #define NMEA_GPS_PLUGIN_GPS_SENSOR_MODEL_H_INCLUDED 16 #include <geometry_msgs/PoseStamped.h> 17 #include <geometry_msgs/TwistStamped.h> 50 GpsSensorModel(
double position_gaussian_noise,
double orientation_gaussian_noise,
double velocity_gaussian_noise);
65 geometry_msgs::Quaternion
addGaussianNoise(geometry_msgs::Quaternion orientation);
98 #endif //NMEA_GPS_PLUGIN_GPS_SENSOR_MODEL_H_INCLUDED
std::normal_distribution position_dist_
normal distribution generator for position
~GpsSensorModel()
destructor of GpsSensorModel class
std::normal_distribution orientation_dist_
normal distribution generator for orientation
std::default_random_engine engine_
random generation engine
std::normal_distribution twist_dist_
normal distribution generator for twist
GpsSensorModel(double position_gaussian_noise, double orientation_gaussian_noise, double velocity_gaussian_noise)
constructer of the GpsSensorModel class
std::random_device seed_gen_
random seed generator
const double velocity_gaussian_noise
variance of the velocity gaussian noise
Class for the GPS sensor model.
const double position_gaussian_noise
variance of the position gaussian noise
const double orientation_gaussian_noise
variance of the orientation gaussian noise
geometry_msgs::Twist addGaussianNoise(geometry_msgs::Twist twist)
add gausiann noise to the twist