PX4-ECL icon indicating copy to clipboard operation
PX4-ECL copied to clipboard

Estimation & Control Library for Guidance, Navigation and Control Applications

Results 24 PX4-ECL issues
Sort by recently updated
recently updated
newest added

Thanks for the great project. I am reading the doc and code; and for some fusion, I am not sure how we use the generated code (from python sympy) in...

Hello! I hope you are doing well! We are a security research team. Our tool automatically detected a vulnerability in this repository. We want to disclose it responsibly. GitHub has...

Hi, I am flying px4 1.12.3 with mavros 1.13.0 providing external position and heading from a T265 module. In one of my flights I had noticed that px4's heading drifted...

I'm working with ground rover without baro, only GPS. I'm using a workaround for EKF initialization without baro (#876), but I found another issue. If GPS data get stopped, firstly...

enhancement
move to PX4-Autopilot

Please how do I convert the 36 float array from nav_msgs to VehicleVisualOdometry.msg in PX4

const Vector3f pos_offset_earth = _R_to_earth * pos_offset_body; _gps_sample_delayed.pos -= pos_offset_earth.xy(); _gps_sample_delayed.hgt += pos_offset_earth(2); pos_offset_earth.xy() is slice type and _gps_sample_delayed.pos is vector2f type. if (_control_status.flags.ev_pos) { Vector3f ev_pos_obs_var; Vector2f ev_pos_innov_gates; //...

The `EKF2_AID_MASK` is set to 24, `EKF2_HGT_MODE` is set to Range sensor. The plot below shows what the problem is. Given what the `EKF2_AID_MASK` & `EKF2_HGT_MODE` are set to, the...

help wanted
move to PX4-Autopilot

When quadrotor fly cross step surface, ranger measure a gap.When in ranger fusion mode,how to process this situation to make measured height no jump point?

In current ekf2 framework, ekf estimator run in internal layer,and complementary filter run in extern layer. Can we use two thread to run these,one thread for complmentary filter and one...

move to PX4-Autopilot

follows https://github.com/PX4/PX4-Autopilot/issues/16489 The EV height starting condition only checks if the gathered data is not too old : https://github.com/PX4/PX4-ECL/blob/b919f3ddf41ab422d09af91eaea2b2f9729fab13/EKF/control.cpp#L1037) In some cases, it can be that the EV system provides...

enhancement
move to PX4-Autopilot