#include <geometry_msgs/TransformStamped.h>#include <functional>#include <memory>#include <boost/optional.hpp>#include "base.h"#include "face.h"#include "body.h"#include "voice.h"#include <hri_msgs/EngagementLevel.h>#include <std_msgs/Float32.h>#include "tf2_ros/transform_listener.h"#include "tf2_ros/message_filter.h"#include "message_filters/subscriber.h"

Go to the source code of this file.
Classes | |
| class | hri::Person |
Namespaces | |
| hri | |
Typedefs | |
| typedef std::shared_ptr< const Person > | hri::PersonConstPtr |
| typedef std::shared_ptr< Person > | hri::PersonPtr |
| typedef std::weak_ptr< const Person > | hri::PersonWeakConstPtr |
| typedef std::weak_ptr< Person > | hri::PersonWeakPtr |
Enumerations | |
| enum | hri::EngagementLevel { hri::DISENGAGED = 1, hri::ENGAGING = 2, hri::ENGAGED = 3, hri::DISENGAGING = 4 } |
Functions | |
| const static std::string | hri::PERSON_TF_PREFIX ("person_") |
| const static ros::Duration | hri::PERSON_TF_TIMEOUT (0.01) |