66 srdf_publisher_ = this->create_publisher<std_msgs::msg::String>(
"robot_description_semantic",
67 rclcpp::QoS(1).transient_local().reliable());
73 on_set_parameters_handle_ =
74 this->add_on_set_parameters_callback([
this](
const std::vector<rclcpp::Parameter>& parameters) {
75 for (
auto const& parameter : parameters)
77 if (parameter.get_name() ==
"robot_description_semantic")
79 std_msgs::msg::String msg;
80 msg.data = parameter.get_value<std::string>();
81 srdf_publisher_->publish(msg);
86 rcl_interfaces::msg::SetParametersResult result;
87 result.successful =
true;
91 rcl_interfaces::msg::ParameterDescriptor descriptor;
92 descriptor.type = rcl_interfaces::msg::ParameterType::PARAMETER_STRING;
93 descriptor.description =
"Semantic Robot Description Format";
94 this->declare_parameter(
"robot_description_semantic", rclcpp::ParameterType::PARAMETER_STRING, descriptor);