Unable to run SITL with Gazebo

I’m trying to run the SITL.
I’m able to run the SITL with JMavsim, bot not with with Gazebo.
When i run:

make px4_sitl gazebo

It looks like it is not connecting to the PX4.
This is all i see in the terminal after some PX4 initializations:

px4 starting.

INFO [px4] Calling startup script: /bin/sh etc/init.d-posix/rcS 0
Info: found model autostart file as SYS_AUTOSTART=10016
INFO [param] selected parameter default file eeprom/parameters_10016
INFO [parameters] BSON document size 406 bytes, decoded 406 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
Gazebo multi-robot simulator, version 9.17.0
Copyright (C) 2012 Open Source Robotics Foundation.
Released under the Apache 2 License.
http://gazebosim.org
INFO [simulator] Waiting for simulator to accept connection on TCP port 4560
Gazebo multi-robot simulator, version 9.17.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: x.x.x.x

I can see the Gazebo environment is started and running with small quad in the bottom, but the simulation is stuck.
I’m using PX4 master and Gazebo 9, witch was installed separately.
Thank you.