Skip to content

Commit

Permalink
msg: add versioning and split into core/aux messages
Browse files Browse the repository at this point in the history
  • Loading branch information
GuillaumeLaine committed Oct 24, 2024
1 parent 84bb6d1 commit 9d3e6b7
Show file tree
Hide file tree
Showing 229 changed files with 293 additions and 234 deletions.
468 changes: 235 additions & 233 deletions msg/CMakeLists.txt

Large diffs are not rendered by default.

File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
3 changes: 3 additions & 0 deletions msg/ActuatorMotors.msg → msg/core/ActuatorMotors.msg
Original file line number Diff line number Diff line change
@@ -1,4 +1,7 @@
# Motor control message

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
uint64 timestamp_sample # the timestamp the data this control response is based on was sampled

Expand Down
3 changes: 3 additions & 0 deletions msg/ActuatorServos.msg → msg/core/ActuatorServos.msg
Original file line number Diff line number Diff line change
@@ -1,4 +1,7 @@
# Servo control message

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
uint64 timestamp_sample # the timestamp the data this control response is based on was sampled

Expand Down
2 changes: 2 additions & 0 deletions msg/ArmingCheckReply.msg → msg/core/ArmingCheckReply.msg
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

uint8 request_id
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

# broadcast message to request all registered arming checks to be reported
Expand Down
2 changes: 2 additions & 0 deletions msg/BatteryStatus.msg → msg/core/BatteryStatus.msg
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
bool connected # Whether or not a battery is connected, based on a voltage threshold
float32 voltage_v # Battery voltage in volts, 0 if unknown
Expand Down
3 changes: 3 additions & 0 deletions msg/ConfigOverrides.msg → msg/core/ConfigOverrides.msg
Original file line number Diff line number Diff line change
@@ -1,4 +1,7 @@
# Configurable overrides by (external) modes or mode executors

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

bool disable_auto_disarm # Prevent the drone from automatically disarming after landing (if configured)
Expand Down
2 changes: 2 additions & 0 deletions msg/GotoSetpoint.msg → msg/core/GotoSetpoint.msg
Original file line number Diff line number Diff line change
Expand Up @@ -5,6 +5,8 @@
# Unset optional setpoints are not controlled
# Unset optional constraints default to vehicle specifications

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

# setpoints
Expand Down
2 changes: 2 additions & 0 deletions msg/HomePosition.msg → msg/core/HomePosition.msg
Original file line number Diff line number Diff line change
@@ -1,5 +1,7 @@
# GPS home position in WGS84 coordinates.

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

float64 lat # Latitude in degrees
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
uint64 timestamp_sample # the timestamp of the raw data (microseconds)

Expand Down
3 changes: 3 additions & 0 deletions msg/ModeCompleted.msg → msg/core/ModeCompleted.msg
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
# The possible values of nav_state are defined in the VehicleStatus msg.
# Note that this is not always published (e.g. when a user switches modes or on
# failsafe activation)

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)


Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

uint64 request_id # ID from the request
Expand Down
Original file line number Diff line number Diff line change
@@ -1,4 +1,7 @@
# Request to register an external component

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

uint64 request_id # ID, set this to a random value
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -3,6 +3,8 @@
# Needs to be kinematically consistent and feasible for smooth flight.
# setting a value to NaN means the state should not be controlled

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

# NED local world frame
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

char[25] name # either the mode name, or component name
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,4 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
uint64 timestamp_sample # timestamp of the data sample on which this message is based (microseconds)
Expand Down
2 changes: 2 additions & 0 deletions msg/VehicleAttitude.msg → msg/core/VehicleAttitude.msg
Original file line number Diff line number Diff line change
@@ -1,6 +1,8 @@
# This is similar to the mavlink message ATTITUDE_QUATERNION, but for onboard use
# The quaternion uses the Hamilton convention, and the order is q(w, x, y, z)

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

uint64 timestamp_sample # the timestamp of the raw data (microseconds)
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

float32 yaw_sp_move_rate # rad/s (commanded by user)
Expand Down
2 changes: 2 additions & 0 deletions msg/VehicleCommand.msg → msg/core/VehicleCommand.msg
Original file line number Diff line number Diff line change
@@ -1,6 +1,8 @@
# Vehicle Command uORB message. Used for commanding a mission / action / etc.
# Follows the MAVLink COMMAND_INT / COMMAND_LONG definition

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

uint16 VEHICLE_CMD_CUSTOM_0 = 0 # test command
Expand Down
2 changes: 2 additions & 0 deletions msg/VehicleCommandAck.msg → msg/core/VehicleCommandAck.msg
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,8 @@
# Used for acknowledging the vehicle command being received.
# Follows the MAVLink COMMAND_ACK message definition

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

# Result cases. This follows the MAVLink MAV_RESULT enum definition
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
bool flag_armed # synonym for actuator_armed.armed

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -5,6 +5,8 @@
# e.g. control inputs of the vehicle in a Kalman-filter implementation.
#

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
uint64 timestamp_sample # the timestamp of the raw data (microseconds)

Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

bool freefall # true if vehicle is currently in free-fall
Expand Down
Original file line number Diff line number Diff line change
@@ -1,6 +1,8 @@
# Fused local position in NED.
# The coordinate system origin is the vehicle position at the time when the EKF2-module was started.

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
uint64 timestamp_sample # the timestamp of the raw data (microseconds)

Expand Down
3 changes: 3 additions & 0 deletions msg/VehicleOdometry.msg → msg/core/VehicleOdometry.msg
Original file line number Diff line number Diff line change
@@ -1,4 +1,7 @@
# Vehicle odometry data. Fits ROS REP 147 for aerial vehicles

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)
uint64 timestamp_sample

Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

# body angular rates in FRD frame
Expand Down
2 changes: 2 additions & 0 deletions msg/VehicleStatus.msg → msg/core/VehicleStatus.msg
Original file line number Diff line number Diff line change
@@ -1,5 +1,7 @@
# Encodes the system state of the vehicle published by commander

uint32 MESSAGE_VERSION = 0

uint64 timestamp # time since system start (microseconds)

uint64 armed_time # Arming timestamp (microseconds)
Expand Down
2 changes: 1 addition & 1 deletion src/modules/commander/failsafe/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -32,7 +32,7 @@
############################################################################

# Extract information from failsafe msg file
set(failsafe_flags_msg_file ${PX4_SOURCE_DIR}/msg/FailsafeFlags.msg)
set(failsafe_flags_msg_file ${PX4_SOURCE_DIR}/msg/aux/FailsafeFlags.msg)
set(generated_uorb_struct_field_mapping_header ${PX4_BINARY_DIR}/generated_uorb_struct_field_mapping.h)
set(html_template_file ${CMAKE_CURRENT_SOURCE_DIR}/emscripten_template.html)
set(html_output_file ${PX4_BINARY_DIR}/failsafe_html_template.html)
Expand Down

0 comments on commit 9d3e6b7

Please sign in to comment.