Gazebo Simulation - ROS interface

Hey all,

I have been having trouble running the Gazebo Sim manually - on branch STABLE.

The default method:

make posix_sitl_default gazebo
roslaunch mavros px4.launch fcu_url:=“udp://:14540@127.0.0.1:14557”

Works perfectly fine, and I can controll the quadrotor via MAVROS (eg. the offboard example).

BUT, when i do it via manual method at:
https://dev.px4.io/en/simulation/ros_interface.html
It fails,
eg. the code i am using:

Terminal 1:
cd Firmware
no_sim=1 make posix_sitl_default gazebo

Terminal 2:
cd Firmware
source Tools/setup_gazebo.bash $(pwd) $(pwd)/build_posix_sitl_default
roslaunch gazebo_ros empty_world.launch world_name:=$(pwd)/Tools/sitl_gazebo/worlds/iris_opt_flow.world

Terminal 3:
roslaunch mavros px4.launch fcu_url:=“udp://:14540@127.0.0.1:14557”

This loads the simulation environment, mavros spits some data, but the quadrotor cant be controlled…

Any idea why?
Please remember this is on branch STABLE