I want to make some changes to the IRIS model. (I use gazebo simulator)
- I want to increase the weight of the drone but still relatively maintain the performance in terms of speed, acceleration and thrust.
- What changes are required to make?
- there is any equation or guidelines for such changes?
- I checked this topic (#110) but its for VTOL model and I dont know the value of some parameters such as
Max Thrust [N]
Max Applied Voltage [V]
. - I tried to make some changes but without success, the drone loses control.
- In addition, I want to improve the performance of the drone in terms of speed, acceleration and thrust.
- I tried to make a number of changes to the parameter in the SDF file for each motor.
These are the default parameters:
<plugin name='front_right_motor_model' filename='libgazebo_motor_model.so'>
<robotNamespace/>
<jointName>rotor_0_joint</jointName>
<linkName>rotor_0</linkName>
<turningDirection>ccw</turningDirection>
<timeConstantUp>0.0125</timeConstantUp>
<timeConstantDown>0.025</timeConstantDown>
<maxRotVelocity>1100</maxRotVelocity>
<motorConstant>5.84e-06</motorConstant>
<momentConstant>0.06</momentConstant>
<commandSubTopic>/gazebo/command/motor_speed</commandSubTopic>
<motorNumber>0</motorNumber>
<rotorDragCoefficient>0.000175</rotorDragCoefficient>
<rollingMomentCoefficient>1e-06</rollingMomentCoefficient>
<motorSpeedPubTopic>/motor_speed/0</motorSpeedPubTopic>
<rotorVelocitySlowdownSim>10</rotorVelocitySlowdownSim>
</plugin>
And again after many failed attempts I posted this Topic.
Will making changes only in the SDF file give the solution?
I assume itās easy to modify but Iāve reached a dead end.