Easy Navigation
Loading...
Searching...
No Matches
IMUPerception.hpp File Reference

Defines data structures and utilities for representing and processing IMU perceptions. More...

#include <string>
#include <vector>
#include "sensor_msgs/msg/imu.hpp"
#include "rclcpp_lifecycle/lifecycle_node.hpp"
#include "easynav_common/types/Perceptions.hpp"
Include dependency graph for IMUPerception.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  IMUPerception
 Represents a single IMU perception from a sensor. More...
 
class  IMUPerceptionHandler
 Handles the creation and updating of IMUPerception instances from sensor_msgs::msg::Imu messages. More...
 

Namespaces

namespace  easynav
 

Typedefs

using IMUPerceptions
 Alias for a vector of shared pointers to IMUPerception objects.
 

Functions

rclcpp::Time get_latest_imu_perceptions_stamp (const IMUPerceptions &perceptions)
 Retrieves the latest timestamp among a set of IMU perceptions.
 

Detailed Description

Defines data structures and utilities for representing and processing IMU perceptions.

This file contains the definition of the IMUPerception class, which holds IMU sensor data, and the IMUPerceptionHandler class, which handles subscriptions to IMU messages and transforms them into IMUPerception instances. It also defines an alias for a collection of such perceptions.