Gazebo offboard INFO notify negative

Hello guys!
Ubuntu 18.04
Ros Melodic
I am running mavros to connect ros-gazebo-iris-drone with ros-melodic so I can run the offboard simulation.
I have been able to do i many times but today I got this error

[0/4] Performing build step for ‘sitl_gazebo’
ninja: no work to do.
[3/4] cd /home/diego/PX4-Autopilot/build/px4_sitl… /home/diego/PX4-Autopilot/build/px4_sitl_default
SITL ARGS
sitl_bin: /home/diego/PX4-Autopilot/build/px4_sitl_default/bin/px4
debugger: none
program: gazebo
model: none
world: none
src_path: /home/diego/PX4-Autopilot
build_path: /home/diego/PX4-Autopilot/build/px4_sitl_default
empty model, setting iris as default
GAZEBO_PLUGIN_PATH :/home/diego/PX4-Autopilot/build/px4_sitl_default/build_gazebo
GAZEBO_MODEL_PATH :/home/diego/PX4-Autopilot/Tools/sitl_gazebo/models
LD_LIBRARY_PATH :/home/diego/PX4-Autopilot/build/px4_sitl_default/build_gazebo
empty world, setting empty.world as default
Using: /home/diego/PX4-Autopilot/Tools/sitl_gazebo/models/iris/iris.sdf
SITL COMMAND: “/home/diego/PX4-Autopilot/build/px4_sitl_default/bin/px4” “/home/diego/PX4-Autopilot/build/px4_sitl_default”/etc -s etc/init.d-posix/rcS -t “/home/diego/PX4-Autopilot”/test_data
Creating symlink /home/diego/PX4-Autopilot/build/px4_sitl_default/etc → /home/diego/PX4-Autopilot/build/px4_sitl_defau

e[0______ __ __ ___
| ___ \ \ \ / / / |
| |/ / \ V / / /| |
| __/ / \ / /
| |
| | / /^\ \ ___ |
_| / / |_/

px4 starting.

INFO [px4] Calling startup script: /bin/sh etc/init.d-posix/rcS 0
INFO [init] found model autostart file as SYS_AUTOSTART=10016
INFO [param] selected parameter default file eeprom/parameters_10016
INFO [parameters] BSON document size 606 bytes, decoded 606 bytes
[param] Loaded: eeprom/parameters_10016
INFO [dataman] Unknown restart, data manager file ‘./dataman’ size is 11798680 bytes
PX4 SIM HOST: localhost
INFO [simulator] Waiting for simulator to accept connection on TCP port 4560
INFO [simulator] Simulator connected on TCP port 4560.
Gazebo multi-robot simulator, version 9.0.0
Copyright (C) 2012 Open Source Robotics Foundation.
Released under the Apache 2 License.
http://gazebosim.org

[Msg] Waiting for master.
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 192.168.1.206
INFO [commander] LED: open /dev/led0 failed (22)
INFO [init] Mixer: etc/mixers/quad_w.main.mix on /dev/pwm_output0
INFO [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 18570 remote port 14550
[Wrn] [GuiIface.cc:120] QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to ‘/tmp/runtime-root’
INFO [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540
INFO [mavlink] mode: Onboard, data rate: 4000 B/s on udp port 14280 remote port 14030
INFO [mavlink] mode: Gimbal, data rate: 400000 B/s on udp port 13030 remote port 13280
INFO [logger] logger started (mode=all)
INFO [logger] Start file log (type: full)
INFO [logger] [logger] ./log/2021-10-22/12_43_16.ulg
INFO [logger] Opened full log file: ./log/2021-10-22/12_43_16.ulg
INFO [mavlink] MAVLink only on localhost (set param MAV_{i}BROADCAST = 1 to enable network)
INFO [mavlink] MAVLink only on localhost (set param MAV
{i}_BROADCAST = 1 to enable network)
INFO [px4] Startup script returned successfully
pxh> [Err] [InsertModelWidget.cc:405] Missing model.config for model “/home/diego/PX4-Autopilot/Tools/sitl_gazebo/models/custom_husky”
INFO [mavlink] partner IP: 127.0.0.1
[Wrn] [Event.cc:61] Warning: Deleting a connection right after creation. Make sure to save the ConnectionPtr from a Connect call
[Err] [ModelDatabase.cc:390] Unable to parse model.config for model[Gazebo]
INFO [tone_alarm] home set
INFO [tone_alarm] notify negative
INFO [mavlink] partner IP: 127.0.0.1
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative
INFO [tone_alarm] notify negative

How can I know from where this error is coming?