Closed AlexisTM closed 6 years ago
If using different topics represents an issue, just use setpoint_raw
. Also there is an open PR on setpoint_attitude
to add support for mav_msgs/RollPitchYawThrust
.
@TSC21 I did not notice the PR. This is not relevant then, sorry :)
That PR: #966 (to keep link)
I do not like the fact that we need to send two messages to different topics to use the Roll Pitch Yaw Trust control. Indeed, this is one low-level control which needs precise delays, but we have to add synchronization for the topics.
Current system:
~setpoint_attitude/attitude
(geometry_msgs/PoseStamped) Send attitude setpoint.~setpoint_attitude/att_throttle
(std_msgs/Float64) Send throttle value(0~1).I would propose to fit it into one message; Following 3 propositions.
hector_quadrotor
andcrazyflie_ros
,geometry_msgs/Twist
orgeometry_msgs/TwistStamped
: I do not like the feeling of using speeds.geometry_msgs/PoseStamped
only.My preference is the last one, an explicit custom message which provides direct compatibility to the mav_control_rw package as well as other ethz-asl packages. While PoseStamped is an almost plug and play solution.