Open hamishwillee opened 3 years ago
@hamishwillee Thanks for posting this issue,
The main reason is that the pwm values of the flight termination has changed on the firmware side, and we need to adjust the parachute threshold value.
However, when trying to fix the problem I noticed also that the firmware is emitting termination pwm values when arming. Therefore the parachute is being deployed before takeoff.
Since there is no way from the simulation side to distinguish flight termination and a normal actuator output now, I am not sure how I can fix this. @bresch Did something change on the termination pwm values?
@Jaeyoung-Lim Something might have changed on the Firmware side but I'm not aware of it. At boot, the PWM signals should go to their "disarmed" and not "failsafe" (used for termination) values.
@bresch I think this wasn't the case before, but now the disarmed value and failsafe values have become identical. Would you have any idea what might have introduced this change?
Would you have any idea what might have introduced this change?
Nope... :(
@Jaeyoung-Lim Is this issue resolved?
@akshata-1 No, unfortunately I was not able to fix it, as you can see in the thread
I'm facing the same issue. Is there any update? @Jaeyoung-Lim
This issue has been mentioned on Discussion Forum for PX4, Pixhawk, QGroundControl, MAVSDK, MAVLink. There might be relevant details there:
https://discuss.px4.io/t/px4-community-q-a-may-10-2023/32060/1
This issue has been mentioned on Discussion Forum for PX4, Pixhawk, QGroundControl, MAVSDK, MAVLink. There might be relevant details there:
https://discuss.px4.io/t/px4-maintainers-call-may-16-2023/32137/1
The instructions in https://docs.px4.io/master/en/simulation/gazebo.html#simulated-parachute-flight-termination explain that you can simulate parachute deployment by first launching the simulator with:
Then force flight termination.
I tested this by forcing an altitude safety geofence violation (set a low altitude ceiling and flew straight up). The flight termination happens - there are GCS notifications and the vehicle crashes. But there is no indication that a parachute is deployed.
How would you know? Shouldn't we see something appear on the screen?