Class Person

Inheritance Relationships

Base Types

Class Documentation

class Person : public hri::FeatureTracker, public std::enable_shared_from_this<Person>

Public Functions

Person(ID id, NodeInterfaces node_interfaces, rclcpp::CallbackGroup::SharedPtr callback_group, std::weak_ptr<const HRIListener> listener, const tf2::BufferCore &tf_buffer, const std::string &reference_frame)
virtual ~Person()
ConstFacePtr face() const

Returns a shared pointer to the face of this person, or a nullptr if this person is currently not associated to any detected face.

ConstBodyPtr body() const

Returns a shared pointer to the body of this person, or a nullptr if this person is currently not associated to any detected body.

ConstVoicePtr voice() const

Returns a shared pointer to the voice of this person, or a nullptr if this person is currently not associated to any detected voice.

inline std::optional<bool> anonymous() const
inline std::optional<EngagementLevel> engagementStatus() const
inline std::optional<float> locationConfidence() const
inline std::optional<ID> alias() const
virtual std::optional<geometry_msgs::msg::TransformStamped> transform() const override

Returns the estimated (stamped) 3D transform of self (if available).