Sensor in Gazebo to be calibrated

Hello,

I train the DQN based on the environment composed by PX4, Gazebo, MAVROS.
After UAV takeoff, it always tips the following content:

[ INFO] [1715791473.068672066, 16.568000000]: GF: mission received
[ INFO] [1715791473.073136395, 16.572000000]: RP: mission received
[ INFO] [1715791473.073205636, 16.572000000]: WP: mission received
[ WARN] [1715791473.315963972, 16.812000000]: CMD: Unexpected command 176, result 0
INFO [commander] Armed by external command
INFO [tone_alarm] arming warning
INFO [commander] Takeoff detected
WARN [health_and_arming_checks] Compass needs calibration - Land now!
WARN [health_and_arming_checks] Compass needs calibration - Land now!
WARN [health_and_arming_checks] Preflight Fail: Attitude failure (roll)
WARN [failsafe] Failsafe activated
INFO [tone_alarm] battery warning (fast)
WARN [failsafe] Failsafe activated
WARN [health_and_arming_checks] Compass needs calibration - Land now!
WARN [health_and_arming_checks] Preflight Fail: Attitude failure (roll)

What’s wrong? Should the Compass in the Gazebo be calibrated? If yes, how to do please?

Thanks a lot.