forked from cesar.alejandro/oscillation_ctrl
Upload files to 'msg'
This commit is contained in:
parent
bd23501e55
commit
017cf58105
|
@ -0,0 +1,8 @@
|
|||
# Contains array of smooth path signal at a given time
|
||||
# ref sign contains des pos, vel, and acc
|
||||
#
|
||||
#std_msgs/Header header # Timestamp
|
||||
geometry_msgs/Vector3 position # Desired pos
|
||||
geometry_msgs/Vector3 velocity # Desired vel
|
||||
geometry_msgs/Vector3 acceleration # Desired acc
|
||||
|
|
@ -0,0 +1,12 @@
|
|||
# Reports position of drone, payload, and the roll angle between them
|
||||
std_msgs/Header header # Header
|
||||
string drone_id # Drone ID
|
||||
geometry_msgs/Pose drone_pos # Drone pose
|
||||
# sensor_msgs/Imu drone_acc # Drone linear acceleration
|
||||
string pload_id # Payload ID
|
||||
geometry_msgs/Pose pload_pos # Payload pose
|
||||
float32 length # Tether length
|
||||
float32 phi # Roll angle between drone and pload
|
||||
float32 phidot # Roll rate
|
||||
float32 theta # Pitch angle between drone and pload
|
||||
float32 thetadot # Pitch rate
|
Loading…
Reference in New Issue