Class ROSDisplay
Defined in File ros_display.h
Inheritance Relationships
Base Type
public reach::Display
Class Documentation
-
class ROSDisplay : public reach::Display
Public Functions
-
ROSDisplay(std::string kinematic_base_frame, double marker_scale, bool use_full_color_range, float hue_low_score, float hue_high_score)
-
void showEnvironment() const override
-
void updateRobotPose(const std::map<std::string, double> &pose) const override
-
void showResults(const reach::ReachResult &db) const override
-
void showReachNeighborhood(const std::map<std::size_t, reach::ReachRecord> &neighborhood) const override
-
void setCollisionMarker(std::string collision_mesh_filename, const std::string collision_mesh_frame)
Protected Attributes
-
const std::string kinematic_base_frame_
-
const double marker_scale_
-
const bool use_full_color_range_
-
const float hue_low_score_
-
const float hue_high_score_
-
visualization_msgs::msg::Marker collision_marker_
-
rclcpp::Publisher<sensor_msgs::msg::JointState>::SharedPtr joint_state_pub_
-
rclcpp::Publisher<visualization_msgs::msg::Marker>::SharedPtr mesh_pub_
-
rclcpp::Publisher<visualization_msgs::msg::Marker>::SharedPtr neighbors_pub_
-
std::shared_ptr<interactive_markers::InteractiveMarkerServer> server_
-
ROSDisplay(std::string kinematic_base_frame, double marker_scale, bool use_full_color_range, float hue_low_score, float hue_high_score)