Go to the documentation of this file.
21 #ifndef TRACKING__TRACKED_OBJECT_HPP_
22 #define TRACKING__TRACKED_OBJECT_HPP_
24 #include <autoware_auto_perception_msgs/msg/detected_object.hpp>
25 #include <autoware_auto_perception_msgs/msg/detected_objects.hpp>
26 #include <autoware_auto_perception_msgs/msg/shape.hpp>
27 #include <autoware_auto_perception_msgs/msg/tracked_objects.hpp>
59 autoware_auto_perception_msgs::msg::TrackedObject::_classification_type;
60 using ShapeMsg = autoware_auto_perception_msgs::msg::Shape;
86 const DetectedObjectMsg::_classification_type & override_classification,
91 void predict(std::chrono::nanoseconds dt);
104 bool should_be_removed(
105 const std::chrono::nanoseconds time_threshold,
106 const std::size_t ticks_threshold)
const;
114 return m_ekf.covariance().topLeftCorner<2, 2>();
120 return Eigen::Vector2d {
125 inline double z() const noexcept {
return m_msg.kinematics.centroid_position.z;}
130 return m_msg.shape[0];
135 return m_msg.kinematics.orientation;
140 TrackedObjectMsg m_msg;
144 std::chrono::nanoseconds m_time_since_last_seen = std::chrono::nanoseconds::zero();
146 std::size_t m_ticks_since_last_seen = 0;
148 std::size_t m_ticks_alive = 1;
170 #endif // TRACKING__TRACKED_OBJECT_HPP_
A collection of tracked objects.
Definition: include/tracking/tracked_object.hpp:158
std::vector< TrackedObject > objects
Tracked objects.
Definition: include/tracking/tracked_object.hpp:161
This file includes common type definition.
autoware_auto_perception_msgs::msg::TrackedObject::_classification_type ObjectClassifications
Definition: include/tracking/tracked_object.hpp:59
A representation of a generic state vectors with specified variables.
Definition: generic_state.hpp:60
const geometry_msgs::msg::Quaternion orientation() const
Definition: include/tracking/tracked_object.hpp:133
This file defines the lanelet2_map_provider_node class.
Definition: quick_sort.hpp:24
autoware_auto_perception_msgs::msg::TrackedObject TrackedObjectMsg
Definition: include/tracking/tracked_object.hpp:56
Definition: common_variables.hpp:39
Eigen::Matrix2d position_covariance() const
Getter for position covariance array.
Definition: include/tracking/tracked_object.hpp:112
ConstAccelerationXY< common::types::float64_t > ConstAccelerationXY64
Definition: common_states.hpp:47
double z() const noexcept
Definition: include/tracking/tracked_object.hpp:125
autoware_auto_perception_msgs::msg::Shape ShapeMsg
Definition: include/tracking/tracked_object.hpp:60
const ShapeMsg & shape() const
Getter for shape.
Definition: include/tracking/tracked_object.hpp:128
float float32_t
Definition: types.hpp:45
Eigen::Vector2d centroid() const
Getter for centroid position.
Definition: include/tracking/tracked_object.hpp:118
Definition: common_variables.hpp:38
A generic linear motion model class.
Definition: linear_motion_model.hpp:42
A class that describes the Wiener process noise.
Definition: wiener_noise.hpp:54
double float64_t
Definition: types.hpp:47
std_msgs::msg::Header::_frame_id_type frame_id
Frame in which the objects exist.
Definition: include/tracking/tracked_object.hpp:163
autoware_auto_perception_msgs::msg::DetectedObject DetectedObjectMsg
Definition: include/tracking/tracked_object.hpp:57
Internal class containing the object state and other information.
Definition: include/tracking/tracked_object.hpp:48
This file holds a collection of states that are commonly used in this package.