Class ReadonlyCommon

Class Documentation

class ReadonlyCommon

Public Types

using BuildingMap = rmf_building_map_msgs::msg::BuildingMap
using Level = rmf_building_map_msgs::msg::Level
using Graph = rmf_building_map_msgs::msg::Graph
using Location = rmf_fleet_msgs::msg::Location
using Path = std::vector<Location>

Public Functions

void set_name(const std::string &name)
std::string get_name() const
rclcpp::Logger logger()
template<typename SdfPtrT>
void read_sdf(SdfPtrT &sdf)
void init(rclcpp::Node::SharedPtr node)
void on_update(Eigen::Isometry3d &pose, double sim_time)

Public Members

rclcpp::Node::SharedPtr ros_node