Class HumansDisplay

Inheritance Relationships

Base Type

  • public rviz_default_plugins::displays::ImageTransportDisplay< sensor_msgs::msg::Image >

Class Documentation

class HumansDisplay : public rviz_default_plugins::displays::ImageTransportDisplay<sensor_msgs::msg::Image>

Public Functions

explicit HumansDisplay(std::unique_ptr<rviz_default_plugins::displays::ROSImageTextureIface> texture)
HumansDisplay()
~HumansDisplay() override
void onInitialize() override
void update(float wall_dt, float ros_dt) override
void reset() override

Public Slots

virtual void updateNormalizeOptions()
void updateShowFaces()
void updateShowBodies()
void updateShowFacialLandmarks()
void updateShowSkeletons()
void updateShowFacialExpressions()
std::string expressionToString(hri::Expression expression)

Protected Functions

void onEnable() override
void onDisable() override
void drawSkeleton(std::string id, int width, int height, std::map<hri::SkeletalKeypoint, hri::PointOfInterest> &skeleton)
void processMessage(const sensor_msgs::msg::Image::ConstSharedPtr msg)