[BUG] SITL Gazebo, Reset world error

I am having the following error when I reset the iris world in gazebo.

Msg] Waiting for master.
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 129.175.4.102
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/motors, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/motor_speed/0, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_1/motors, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_1/motor_speed/0, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_1/motor_speed/1, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_1/motor_speed/2, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_1/motor_speed/3, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_2/motor_speed/1, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_2/motor_speed/2, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris_2/motor_speed/3, deleting message. This warning is printed only once.
[Err] [gazebo_motor_model.cpp:191] Aliasing on motor [0] might occur. Consider making smaller simulation time steps or raising the rotor_velocity_slowdown_sim_ param.
[Err] [gazebo_motor_model.cpp:191] Aliasing on motor [1] might occur. Consider making smaller simulation time steps or raising the rotor_velocity_slowdown_sim_ param.
[Err] [gazebo_motor_model.cpp:191] Aliasing on motor [2] might occur. Consider making smaller simulation time steps or raising the rotor_velocity_slowdown_sim_ param.
[Err] [gazebo_motor_model.cpp:191] Aliasing on motor [3] might occur. Consider making smaller simulation time steps or raising the rotor_velocity_slowdown_sim_ param.
gzserver: /meta/Spider-pig/Firmware/Tools/sitl_gazebo/src/gazebo_imu_plugin.cpp:194: void gazebo::GazeboImuPlugin::addNoise(Eigen::Vector3d*, Eigen::Vector3d*, double): Assertion `dt > 0.0’ failed.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/user_camera/pose, deleting message. This warning is printed only once.

after a while gazebo freeze and terminate

I don’t think reseting the world is currently supported by the way PX4 interacts with Gazebo.

And you can see where it goes wrong:

/meta/Spider-pig/Firmware/Tools/sitl_gazebo/src/gazebo_imu_plugin.cpp:194: void gazebo::GazeboImuPlugin::addNoise(Eigen::Vector3d*, Eigen::Vector3d*, double): Assertion `dt > 0.0' failed.

Thanks for your answer, @JulianOes

In fact, I am looking more specifically to reset the model position, I found that it is possible using the View panel in gazebo.
I have tried to write several code to reset the mode automatically from the outside even being inspired by the source code of gazebo itself. However, the code I have written does not do anything.
I do not know if you have an idea why it does not working. Should the code be implemented as a plugin?? or I missed something ?

      /*  C++ Standard library include */                                                                                                                                                                               
# include <cstdlib>                                                                                                                                                                                               
# include <string>                                                                                                                                                                                                
# include <future>                                                                                                                                                                                                
# include <chrono>                                                                                                                                                                                                     
# include <thread>                                                                                                                                                                                                
# include <vector>                                                                                                                                                                                                
                                                                                                                                                                                                                  
/*  locale defined include */                                                                                                                                                                                     
# include "gazebo.hh"                                                                                                                                                                                             
                                                                                                                                                                                                                  
int main(int argc, char* argv[])                                                                                                                                                                                  
{                                                                                                                                                                                                                 
                                                                                                                                                                                                                  
  gazebo::transport::NodePtr node(new gazebo::transport::Node());                                                                                                                                                 
                                                                                                                                                                                                                  
  /*  start resetting the world  */                                                                                                                                                                               
                                                                                                                                                                                                                  
  gazebo::transport::PublisherPtr reset_pub;                                                                                                                                                                      
                                                                                                                                                                                                                  
  gazebo::transport::PublisherPtr  userCmdPub;                                                                                                                                                                    
                                                                                                                                                                                                                  
  node->Init("iris.world");                                                                                                                                                                                       
  node->GetTopicNamespace();                                                                                                                                                                                      
                                                                                                                                                                                                                  
  //  ~/world_control                                                                                                                                                                                             
                                                                                                                                                                                                                  
  reset_pub = node->Advertise<gazebo::msgs::WorldControl>("~/world_control");                                                                                                                                     
                                                                                                                                                                                                                  
  userCmdPub = node->Advertise<gazebo::msgs::UserCmd>("~/user_cmd");                                                                                                                                              
                                                                                                                                                                                                                  
                                                                                                                                                                                                                  
  gazebo::msgs::WorldControl msg;                                                                                                                                                                                 
                                                                                                                                                                                                                  
  //  w_ctrl.reset(); //->set_all(true); //I believe this is equal to indicating a world reset                                                                                                                    
  msg.mutable_reset()->set_all(false);                                                                                                                                                                            
  msg.mutable_reset()->set_time_only(false);                                                                                                                                                                      
                                                                                                                                                                                                                  
  msg.mutable_reset()->set_model_only(true);                                                                                                                                                                      
                                                                                                                                                                                                                  
  gazebo::msgs::UserCmd userCmdMsg;                                                                                                                                                                               
  userCmdMsg.set_description("Reset models");                                                                                                                                                                     
  userCmdMsg.set_type(gazebo::msgs::UserCmd::WORLD_CONTROL);                                                                                                                                                      
  userCmdMsg.mutable_world_control()->CopyFrom(msg);                                                                                                                                                              
  userCmdPub->Publish(userCmdMsg);                                                                                                                                                                                
                                                                                                                                                                                                                  
  reset_pub->Publish(msg);                                                                                                                                                                                        
                                                                                                                                                                                                                  
} 

I would like to reset the model only after the quadcopters have landed. No reset model position have been preformed if the quadcopters where flying.

Best regards,

This seems like a separate issue that. I would recommend you create a new post here, or over at the Gazebo forums:
http://answers.gazebosim.org/questions/