Class SkeletonsDisplay

Inheritance Relationships

Base Type

  • public rviz_common::Display

Class Documentation

class SkeletonsDisplay : public rviz_common::Display

Public Functions

SkeletonsDisplay()
~SkeletonsDisplay() override
void onInitialize() override
void update(float wall_dt, float ros_dt) override
void fixedFrameChanged() override
void reset() override
void clear()

Protected Functions

virtual void load_urdf(HumanPtr &human)
void display_urdf_content(HumanPtr &human)
void updateRobot(HumanPtr &human)
void updateBodies()
void onEnable() override
void onDisable() override

Protected Attributes

std::map<std::string, HumanPtr> humans_
bool has_new_transforms_

it needs to update the transforms

Callback sets this to tell our update function

float time_since_last_transform_
rviz_common::properties::Property *visual_enabled_property_
rviz_common::properties::Property *collision_enabled_property_
rviz_common::properties::FloatProperty *update_rate_property_
rviz_common::properties::FloatProperty *alpha_property_
rviz_common::properties::StringProperty *tf_prefix_property_
rviz_common::properties::Property *mass_properties_
rviz_common::properties::Property *mass_enabled_property_
rviz_common::properties::Property *inertia_enabled_property_
std::unique_ptr<rviz_default_plugins::transformation::TransformerGuard<rviz_default_plugins::transformation::TFFrameTransformer>> transformer_guard_
rclcpp::Executor::SharedPtr hri_executor_
rclcpp::Node::SharedPtr hri_node_
rclcpp::Node::SharedPtr async_client_node_
std::shared_ptr<hri::HRIListener> hri_listener_