Models are not spawning at positions in world files model include pose

Hello,
I am trying to add more than one drone to my gazebo world, but although my models are created at the pose coordinate where I include my models in my .world file, it is added as a box from that coordinate to coordinate 0,0. (screenshot) This box affects collision and causes problems in the sitl where I connect my drones. How can I solve this situation?

my world file

<?xml version="1.0" ?> -5 0 1 0 0.2 0 quick 100 1.0 0.0 0.2 0.1 0.0 -1 0 0 -9.8 model://sun
<model name="ground_plane">
  <static>true</static>
  <link name="link">
    <collision name="collision">
      <geometry>
        <plane>
          <normal>0 0 1</normal>
          <size>5000 5000</size>
        </plane>
      </geometry>
      <surface>
        <friction>
          <ode>
            <mu>100</mu>
            <mu2>50</mu2>
          </ode>
        </friction>
      </surface>
    </collision>
    <visual name="runway">
      <pose>000 0 0.005 0 0 0</pose>
      <cast_shadows>false</cast_shadows>
      <geometry>
        <plane>
          <normal>0 0 1</normal>
          <size>1829 45</size>
        </plane>
      </geometry>
      <material>
        <script>
          <uri>file://media/materials/scripts/gazebo.material</uri>
          <name>Gazebo/Runway</name>
        </script>
      </material>
    </visual>

    <visual name="grass">
      <pose>0 0 -0.1 0 0 0</pose>
      <cast_shadows>false</cast_shadows>
      <geometry>
        <plane>
          <normal>0 0 1</normal>
          <size>5000 5000</size>
        </plane>
      </geometry>
      <material>
        <script>
          <uri>file://media/materials/scripts/gazebo.material</uri>
          <name>Gazebo/Grass</name>
        </script>
      </material>
    </visual>

  </link>
</model>

<model name="drone_1">
  <include>
    <uri>model://drone1</uri>
    <pose>0 2 0 0 0 0</pose>
  </include>
</model>

 <model name="drone_2">
  <include>
    <uri>model://drone2</uri>
    <pose>0 -2 0 0 0 0</pose>
  </include>
</model>

This question is best suited for https://robotics.stackexchange.com/. Can you please post it there?