Launch costom vtol model for px4_sitl gazebo

I am trying to simulate by running the aircraft modeled in solidworks with px4_sitl gazebo.
Now, sdf (copied every plugins from standard_vtol), config file has been created.
Manual model import from Gazebo also worked,
Now, in order to simulate this model in gazebo by applying the px4 firmware and linking it with QGC

I followed the manual above

[0/1] cd /home/hancom/PX4-Autopilot/bu...default -- gazebo-classic_vtol_ver_7.2
WARNING gazebo_vtol_ver_7.2 target DEPRECATED, please use gazebo-classic_vtol_ver_7.2
[0/4] Performing build step for 'sitl_gazebo-classic'
ninja: no work to do.
[3/4] cd /home/hancom/PX4-Autopilot/bu...m/PX4-Autopilot/build/px4_sitl_default
SITL ARGS
sitl_bin: /home/hancom/PX4-Autopilot/build/px4_sitl_default/bin/px4
debugger: none
model: vtol_ver_7.2
world: none
src_path: /home/hancom/PX4-Autopilot
build_path: /home/hancom/PX4-Autopilot/build/px4_sitl_default
GAZEBO_PLUGIN_PATH :/home/hancom/PX4-Autopilot/build/px4_sitl_default/build_gazebo-classic
GAZEBO_MODEL_PATH :/home/hancom/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models
LD_LIBRARY_PATH /home/hancom/catkin_ws/devel/lib:/opt/ros/noetic/lib:/home/hancom/PX4-Autopilot/build/px4_sitl_default/build_gazebo-classic
empty world, setting empty.world as default
Using: /home/hancom/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models/vtol_ver_7.2/vtol_ver_7.2.sdf
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
/home/hancom/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_run.sh: line 147: 13686 Segmentation fault      (core dumped) gzserver $verbose $world_path $ros_args
SITL COMMAND: "/home/hancom/PX4-Autopilot/build/px4_sitl_default/bin/px4" "/home/hancom/PX4-Autopilot/build/px4_sitl_default"/etc

______  __   __    ___ 
| ___ \ \ \ / /   /   |
| |_/ /  \ V /   / /| |
|  __/   /   \  / /_| |
| |     / /^\ \ \___  |
\_|     \/   \/     |_/

px4 starting.

INFO  [px4] startup script: /bin/sh etc/init.d-posix/rcS 0
INFO  [init] found model autostart file as SYS_AUTOSTART=1045
INFO  [param] selected parameter default file parameters.bson
INFO  [param] importing from 'parameters.bson'
INFO  [parameters] BSON document size 404 bytes, decoded 404 bytes (INT32:14, FLOAT:6)
INFO  [param] selected parameter backup file parameters_backup.bson
  SYS_AUTOCONFIG: curr: 0 -> new: 1
+ SYS_AUTOSTART: curr: 1040 -> new: 1045
* SENS_BOARD_X_OFF: curr: 0.0000 -> new: 0.0000
* SENS_DPRES_OFF: curr: 0.0000 -> new: 0.0010
Error: no autostart file found ()
ERROR [px4] Startup script returned with return value: 256
/home/hancom/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_run.sh: line 173: kill: (13686) - No such process

This is an error that cannot be resolved.
Is there something I missed or did wrong?
Thanks for reading the rambling post.
I’m just a student studying unmanned aerial vehicle systems…

Waiting for your reply…

Tried SITL PX4 with Gazebo, but with ROS, I never tried to connect to Qgroundcontrol, in ROS env, the PX4 is treated as a ros pkg. In this situation, I did not need to move or copy any files, just needed to source them.