Gazebo simulator does not respond to command sent by mavproxy but SITL does

I followed the steps here to install Gazebo-ardupilot plugin.
When I launch SITL and Gazebo as mentioned in the documentation, Gazebo does not respond to the command sent to SITL.

In SITL command line, the Gazebo class is compiled and loaded:

[391/502] Compiling libraries/SITL/SIM_Gazebo.cpp
SIM_VEHICLE: Using defaults from (/home/soubhi/Desktop/ardupilot/Tools/autotest/default_params/copter.parm,/home/soubhi/Desktop/ardupilot/Tools/autotest/default_params/gazebo-iris.parm)
S IM_VEHICLE: Run ArduCopter
SIM_VEHICLE: "/home/soubhi/Desktop/ardupilot/Tools/autotest/run_in_terminal_window.sh" "ArduCopter" "/home/soubhi/Desktop/ardupilot/build/sitl/bin/arducopter" "-S" "-I0" "--home" "-35.363261,149.165230,584,353" "--model" "gazebo-iris" "--speedup" "1" "--defaults" "/home/soubhi/Desktop/ardupilot/Tools/autotest/default_params/copter.parm,/home/soubhi/Desktop/ardupilot/Tools/autotest/default_params/gazebo-iris.parm"
SIM_VEHICLE: Run MavProxy
SIM_VEHICLE: "mavproxy.py" "--master" "tcp:127.0.0.1:5760" "--sitl" "127.0.0.1:5501" "--out" "127.0.0.1:14550" "--out" "127.0.0.1:14551" "--mav10" "--map" "--console"
RiTW: Starting ArduCopter : /home/soubhi/Desktop/ardupilot/build/sitl/bin/arducopter -S -I0 --home -35.363261,149.165230,584,353 --model gazebo-iris --speedup 1 --defaults /home/soubhi/Desktop/ardupilot/Tools/autotest/default_params/copter.parm,/home/soubhi/Desktop/ardupilot/Tools/autotest/default_params/gazebo-iris.parm

The output from Gazebo command line:
Msg] Waiting for master.
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 192.168.1.112
[Wrn] [msgs.cc:1793] Conversion of sensor type[imu] not suppported.
[Wrn] [msgs.cc:1793] Conversion of sensor type[imu] not suppported.
[Wrn] [msgs.cc:1793] Conversion of sensor type[imu] not suppported.
[Err] [Scene.cc:2928] Light [sun] not found. Use topic ~/factory/light to spawn a new light.
[Wrn] [msgs.cc:1793] Conversion of sensor type[imu] not suppported.
[Wrn] [ModelDatabase.cc:212] Unable to connect to model database using[http://gazebosim.org/models/brick_box_3x1x3/model.config]. Only locally installed models will be available.[Err] [ModelDatabase.cc:394] Unable to get model name[http://gazebosim.org/models/brick_box_3x1x3]

I even tried to open port 11345 in mavproxy:
mavproxy.py --master=127.0.1:14550 --sitl 127.0.0.1:5501 --out 127.0.0.1:11345

Operating system: fedora
Gazebo version: 7
SITL Ardupilot is latest one

I will appreciate any help!

Hi @Subhi did you run this command gazebo --verbose worlds/iris_irlock_demo.world after copying your worlds from ardupilot_gazebo/gazebo_worlds to /usr/share/gazebo-7/worlds/?

Also, you can try copying ardupilot_gazebo/gazebo_models to ~/.gazebo/models

Finally it worked after many hours. I do not know what was the problem but after restarting the computer it starts working. Thank you!