Commit Graph

25 Commits

Author SHA1 Message Date
TSC21 145e7387fb posix: start the microRTPS client in sim every time the module is available 2021-06-21 16:36:44 +02:00
bbworld 7525722b1a Add support for specifying spawn location in Gazebo multi sim
This commit adds support for specifying the spawn location of vehicles
in the Gazebo multi-vehicle simulator script (frame:number:x:y).
Behavior when x and y are not specified remains the same as before.
2021-03-05 21:26:54 +01:00
SungTae Moon b7ff54b034
add label option for various airframes using same model (#17003) 2021-03-04 09:29:38 +01:00
Mohamed Abdelkader Zahana 80dd841cad
Update launch files to enable multi-video stream in SITL (#16497)
* Update launch files to support multi-video stream in SITL

* Pass extra args to jinja_gen.py inside gazebo_sitl_multiple_run.sh to enable multi-video streaming
2021-01-08 19:29:47 +01:00
JaeyoungLim e8cefcafbc
Fix gazebo_sitl_multiple_run.sh scripting (#16340)
This commit fixes the problem when using scripting options. This regression was introduced by #15463
2020-12-07 06:17:15 +01:00
bbworld1 5e6f8a9606
Add typhoon h480 support to gazebo multiple sim (#16210)
* Add typhoon h480 support to gazebo multiple sim

This commit adds support for the typhoon_h480 model for the
gazebo_sitl_multiple_run.sh script.

* Update sitl_gazebo to latest version
2020-11-17 04:20:45 +01:00
JaeyoungLim 9e5cf3a598
Enable multiple rover simulations (#15904)
This commit allows running multiple simulations with rovers
2020-11-03 14:55:32 +01:00
JaeyoungLim ff6b82cb6b
Replace xacro macros to jinja templates for multivehicle (#15831)
This commit switches xacro macros to jinja templates for multivehicle simulations.
2020-09-29 15:45:57 +02:00
Beat Küng 055fa768d8 posix: enable ROMFSROOT
This will copy the ROMFS into the build directory under etc/, and thus
needs a change of the PX4 startup parameters and mixer paths.
2020-09-15 09:30:16 +02:00
SungTae Moon 9707ac5316
implement gazebo simulation based on RTPS for multiple UAVs (#15463)
- add t option for target
   - add iris_rtps model (PX4/sitl_gazebo#558)
2020-08-08 13:19:19 +02:00
Jan-Hendrik Ewers 0b50f85096
Update gazebo_sitl_multiple_run.sh (#15382)
If `make px4_sitl_default` is run, and not `make px4_sitl_default gazebo` then each model instance will throw the following errors:
```
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_gps_plugin.so: libgazebo_gps_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_multirotor_base_plugin.so: libgazebo_multirotor_base_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_groundtruth_plugin.so: libgazebo_groundtruth_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_magnetometer_plugin.so: libgazebo_magnetometer_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_barometer_plugin.so: libgazebo_barometer_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_mavlink_interface.so: libgazebo_mavlink_interface.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:178] Failed to load plugin libgazebo_imu_plugin.so: libgazebo_imu_plugin.so: cannot open shared object file: No such file or directory
```
2020-07-21 09:36:15 +09:00
JaeyoungLim 3ef852c8e3
sitl: enable spawning different vehicle types for multivehicle SITL in gazebo (#15147)
This can be run with the command `Toos/gazebo_multiple_sitl_run.sh -s plane:3,iris:1
2020-06-24 08:23:16 +02:00
JaeyoungLim e669e999e2
Add options to spawn multiple vehicles in different worlds (#14764)
Since SITL gazebo now has the ability to spawn vehicles to different worlds, this can be done for simulating multiple vehicles
2020-04-27 11:57:47 +02:00
JaeyoungLim 01b280f7ae Limit the number of vehicles 2020-02-19 14:23:17 +01:00
JaeyoungLim 15835ce7a3 Add standard_vtol as supported model for multivehicle sim gazebo
Fix
2020-01-27 09:16:24 +01:00
RomanBapst 4d4481a384 gazebo_sitl_multiple_run.sh: fixed comment
Signed-off-by: RomanBapst <bapstroman@gmail.com>
2020-01-10 16:51:33 +01:00
JaeyoungLim 528141a78e Make more space between vehicles 2020-01-10 16:51:33 +01:00
JaeyoungLim 0324889cf7 Add support for plane 2020-01-10 16:51:33 +01:00
JaeyoungLim eb7cdb4c4e Use sdf files instead of urdf files
Fix
2020-01-10 16:51:33 +01:00
JaeyoungLim d5100b10dc Update comments 2019-12-26 12:03:32 +01:00
RomanBapst eeb47f6148 gazebo multiple sim script: cleanup
- make sure to kill all px4 instances and gazebo client when exiting
- add arguments to specify number of vehicles and vehicle model
- exit for now if vehicle model is not iris, since needs changes in
sitl_gazebo submodule

Signed-off-by: RomanBapst <bapstroman@gmail.com>
2019-12-26 12:03:32 +01:00
JaeyoungLim 876f42c171 Source environment inside the script 2019-12-26 12:03:32 +01:00
JaeyoungLim 155a212109 Update comments 2019-12-26 12:03:32 +01:00
JaeyoungLim f653be75c0 gazebo multiple sim: use xacro from the sitl_gazebo repository
Signed-off-by: RomanBapst <bapstroman@gmail.com>
2019-12-26 12:03:32 +01:00
JaeyoungLim 0b649326c3 Support multi vehicle sitl gazebo without ros 2019-12-26 12:03:32 +01:00