![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg
Services
Plugins
Recent questions tagged eufs_msgs at Robotics Stack Exchange
![]() |
eufs_msgs package from autonomous-systems repocommon_lib control custom_interfaces ekf_state_est eufs_msgs evaluator fs_msgs inspection launcher mocker_node pacsim pacsim_keys perception planning power_log |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 2.0.0 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | 🏎️ Formula Student FEUP Autonomous Systems Department Repository |
Checkout URI | https://github.com/fs-feup/autonomous-systems.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-06-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Niklas Burggraaff
Authors
eufs_msgs
A collection of all ROS messages and services used by EUFS.
Messages:
Name | Description |
---|---|
CarState.msg | describes the internal state of the car. Similar to the nav_msgs/Odometry message this contains the position, orientation, linear velocity, angular velocity, wheel speeds and slip ratio of the car. |
CanState.msg | used to communicate with the ADS-DV board computer via CAN. Used in ros_can package |
ConeArray.msg | used to publish 2D locations of blue, yellow, orange and big cones |
ConeArrayWithCovariance.msg | as ConeArray, but contains covariance info |
ConeAssociation.msg | a link between two cones in the same frame, observed cone and cone in map typically |
ConeAssociationArray.msg | a set of cone associations, matched and unmatched with metadata |
ConeAssociationArrayArrayStamped.msg | header and array of ConeAssociationArray |
ConeAssociationArrayStamped.msg | a set of cone associations, header and ConeAssociationArray associations |
ConeWithCovariance.msg | a pose and covariance matrix representing a single cone |
FullState.msg | used for data collection during dynamics learning for MPPI training |
IntegrationErr.msg | Error of Odometry Integration based on euclidean distance. Used by localization’s integration_evaluator script |
LapStats.msg | useful statistics from lap timings |
PathIntegralParams.msg | MPPI paramteres |
PathIntegralStats.msg | Combines LapStats and PathIntegralParams. Used for evaluating performance of MPPI |
PointArray.msg | array of geometry_mgsgs/Point. Used in perception for colourless cone detections |
PointArrayStamped.msg | as above but with std_msgs/Header |
SLAMState.msg | Status output message of the SLAM algorithm. Also counts laps! |
EKFState.msg | Status output message of the EKF algorithm. |
SLAMErr.msg | Error measure for SLAM, used to objectively evaluate simulation performance |
EKFErr.msg | Error measure for EKF, used to objectively evaluate simulation performance |
Particle.msg | the state of a single particle. Pose, associated map and weighting |
ParticleSLAM.msg | the state of a particle-based SLAM algorithm. Array of Particle and index of best guess in this array |
ParticleSLAMStamped.msg | ParticleSLAM with reference frame and timestamp. (State and header.) |
ParticleStamped.msg | Particle with reference coordinate frame and timestamp |
SystemState.msg | overall mission status of the car. Used in the ros_can package |
StereoImage.msg | Contains color and depth image |
WheelOdometryErr.msg | Error of Wheel Odometry based on euclidean distance. Used by localization’s wheel_odometery_evaluator script |
WheelSpeeds.msg | output of the wheel odometry. Used in the ros_can package |
WheelSpeedsStamped.msg | same as the above but with std_msgs/Header |
Waypoint.msg | suggested control outputs at each point of path produced by planning nodes |
WaypointArrayStamped.msg | array of Waypoint.msg with a header |
Services:
Changelog
All notable changes to this project will be documented in this file. The format is based on Keep a Changelog, and this project adheres to Semantic Versioning.
[2.0.0] - 2022-01-05
Added
- IntegrationErr msg
- WheelOdometryErr msg
- AMI_JOYSTICK in CanState msg (AMI_MANUAL moved to 21)
- Speed variance, normalized path deviation MSE, path deviation variance and max path deviation in LapStats msg
- Support frame percentage in BoundingBox msg
Changed
- Remove duplication of WheelSpeeds attributes in WheelSpeedsStamped msg
Removed
- Mission flag in CanState msg
[1.0.0] - 2022-01-05
Added
- BoundingBox msg
- BoundingBoxes msg
- CanState msg
- CarState msg
- ChassisCommand msg
- ChassisState msg
- ConeArray msg
- ConeArrayWithCovariance msg
- ConeWithCovariance msg
- Costmap msg
- EKFErr msg
- EKFState msg
- FullState msg
- LapStats msg
- PathIntegralParams msg
- PathIntegralStats msg
- PathIntegralStatus msg
- PathIntegralTiming msg
- PointArray msg
- PointArrayStamped msg
- Runstop msg
- SLAMErr msg
- SLAMState msg
- SystemStatus msg
- TopicStatus msg
- Waypoint msg
- WaypointArrayStamped msg
- WheelSpeeds msg
- WheelSpeedsStamped msg
- CheckForObjects action
Package Dependencies
Deps | Name |
---|---|
std_msgs | |
geometry_msgs | |
sensor_msgs | |
ament_cmake | |
rosidl_default_generators | |
rosidl_default_runtime | |
ament_lint_common |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/BoundingBox.msg
- msg/BoundingBoxes.msg
- msg/CanState.msg
- msg/CarState.msg
- msg/ChassisCommand.msg
- msg/ChassisState.msg
- msg/ConeArray.msg
- msg/ConeArrayWithCovariance.msg
- msg/ConeArrayWithCovariancePlus.msg
- msg/ConeAssociation.msg
- msg/ConeAssociationArray.msg
- msg/ConeAssociationArrayArrayStamped.msg
- msg/ConeAssociationArrayStamped.msg
- msg/ConeWithCovariance.msg
- msg/ConeWithCovariancePlus.msg
- msg/Costmap.msg
- msg/EKFErr.msg
- msg/EKFState.msg
- msg/FullState.msg
- msg/Heartbeat.msg
- msg/IntegrationErr.msg
- msg/LapStats.msg
- msg/MPCState.msg
- msg/NodeState.msg
- msg/NodeStateArray.msg
- msg/OSS.msg
- msg/Particle.msg
- msg/ParticleSLAM.msg
- msg/ParticleSLAMStamped.msg
- msg/ParticleStamped.msg
- msg/PathIntegralParams.msg
- msg/PathIntegralStats.msg
- msg/PathIntegralStatus.msg
- msg/PathIntegralTiming.msg
- msg/PlanningMode.msg
- msg/PointArray.msg
- msg/PointArrayStamped.msg
- msg/PurePursuitCheckpoint.msg
- msg/PurePursuitCheckpointArrayStamped.msg
- msg/Runstop.msg
- msg/SLAMErr.msg
- msg/SLAMState.msg
- msg/StateMachineState.msg
- msg/StereoImage.msg
- msg/SystemStatus.msg
- msg/TopicStatus.msg
- msg/VehicleCommands.msg
- msg/VehicleCommandsStamped.msg
- msg/Waypoint.msg
- msg/WaypointArrayStamped.msg
- msg/WheelOdometryErr.msg
- msg/WheelSpeeds.msg
- msg/WheelSpeedsStamped.msg