当前位置: 首页 > wzjs >正文

网站信息内容建设自查报告推广管理

网站信息内容建设自查报告,推广管理,天河区做网站的公司,凤凰自媒体平台注册术语 DDS (Data Distribution Service): 用于实时系统的数据分发服务标准,是ROS 2底层通信的基础RMW (ROS Middleware): ROS中间件接口,提供与具体DDS实现无关的抽象APIQoS (Quality of Service): 服务质量策略,控制通信的可靠性、历史记录、…

术语

  • DDS (Data Distribution Service): 用于实时系统的数据分发服务标准,是ROS 2底层通信的基础
  • RMW (ROS Middleware): ROS中间件接口,提供与具体DDS实现无关的抽象API
  • QoS (Quality of Service): 服务质量策略,控制通信的可靠性、历史记录、耐久性等属性
  • 符号解析: 动态库加载过程中,查找和绑定函数指针的机制

1. 架构概述

ROS2采用分层设计,通过多层抽象实现高度灵活性和可插拔性。其调用链如下:

应用层(开发人员) → rclcpp(C++客户端库) → rcl(C语言客户端库) → rmw(中间件接口) → rmw_implementation(动态加载层) → 具体DDS实现

2. 发布者创建流程详解

2.1 用户代码层(rclcpp::Node::create_publisher)

通常使用以下代码创建发布者:

auto node = std::make_shared<rclcpp::Node>("publisher_node");
auto publisher = node->create_publisher<std_msgs::msg::String>("topic_name", 10);  // 队列深度为10

2.2 rclcpp层(Node类)

node.hpp文件中对各模板函数进行声明,函数的具体实现在node_impl.hpp文件中进行定义。

class Node : public std::enable_shared_from_this<Node>
{template<typename MessageT,typename AllocatorT = std::allocator<void>,typename PublisherT = rclcpp::Publisher<MessageT, AllocatorT>>std::shared_ptr<PublisherT>create_publisher(const std::string & topic_name,const rclcpp::QoS & qos,const PublisherOptionsWithAllocator<AllocatorT> & options =PublisherOptionsWithAllocator<AllocatorT>());
}

node_impl.hpp文件中,node->create_publisher 调用一系列rclcpp函数:

template<typename MessageT, typename AllocatorT, typename PublisherT>
std::shared_ptr<PublisherT>
Node::create_publisher(const std::string & topic_name,const rclcpp::QoS & qos,const PublisherOptionsWithAllocator<AllocatorT> & options)
{return rclcpp::create_publisher<MessageT, AllocatorT, PublisherT>(*this,extend_name_with_sub_namespace(topic_name, this->get_sub_namespace()),qos,options);
}

该方法调用create_publisher.hpp文件的node_topics_interface->create_publisher创建类型特定的工厂

template<typename MessageT,typename AllocatorT = std::allocator<void>,typename PublisherT = rclcpp::Publisher<MessageT, AllocatorT>,typename NodeParametersT,typename NodeTopicsT>
std::shared_ptr<PublisherT>
create_publisher(NodeParametersT & node_parameters,NodeTopicsT & node_topics,const std::string & topic_name,const rclcpp::QoS & qos,const rclcpp::PublisherOptionsWithAllocator<AllocatorT> & options = (rclcpp::PublisherOptionsWithAllocator<AllocatorT>())
)
{auto node_topics_interface = rclcpp::node_interfaces::get_node_topics_interface(node_topics);const rclcpp::QoS & actual_qos = options.qos_overriding_options.get_policy_kinds().size() ?rclcpp::detail::declare_qos_parameters(options.qos_overriding_options, node_parameters,node_topics_interface->resolve_topic_name(topic_name),qos, rclcpp::detail::PublisherQosParametersTraits{}) :qos;// Create the publisher.auto pub = node_topics_interface->create_publisher(topic_name,rclcpp::create_publisher_factory<MessageT, AllocatorT, PublisherT>(options),actual_qos);// Add the publisher to the node topics interface.node_topics_interface->add_publisher(pub, options.callback_group);return std::dynamic_pointer_cast<PublisherT>(pub);
}

node_topics_interface->create_publisher实际调用node_topics.cpp文件的NodeTopics::create_publisher非模板方法,该方法使用publisher_factory.hpp文件中工厂的create_typed_publisher函数创建实际的发布者,创建的发布者进行后期初始化设置。

rclcpp::PublisherBase::SharedPtr
NodeTopics::create_publisher(const std::string & topic_name,const rclcpp::PublisherFactory & publisher_factory,const rclcpp::QoS & qos)
{// Create the MessageT specific Publisher using the factory, but return it as PublisherBase.return publisher_factory.create_typed_publisher(node_base_, topic_name, qos);
}

create_typed_publisher的实现如下:

template<typename MessageT, typename AllocatorT, typename PublisherT>
PublisherFactory
create_publisher_factory(const rclcpp::PublisherOptionsWithAllocator<AllocatorT> & options)
{PublisherFactory factory {// factory function that creates a MessageT specific PublisherT[options](rclcpp::node_interfaces::NodeBaseInterface * node_base,const std::string & topic_name,const rclcpp::QoS & qos) -> std::shared_ptr<PublisherT>{auto publisher = std::make_shared<PublisherT>(node_base, topic_name, qos, options);// This is used for setting up things like intra process comms which// require this->shared_from_this() which cannot be called from// the constructor.publisher->post_init_setup(node_base, topic_name, qos, options);return publisher;}};// return the factory now that it is populatedreturn factory;
}

创建特定的Publisher时,publisher.hpp文件内部会转到具体的Publisher构造函数:

Publisher(rclcpp::node_interfaces::NodeBaseInterface * node_base,const std::string & topic,const rclcpp::QoS & qos,const rclcpp::PublisherOptionsWithAllocator<AllocatorT> & options)
: PublisherBase(node_base,topic,rclcpp::get_message_type_support_handle<MessageT>(),options.template to_rcl_publisher_options<MessageT>(qos)),options_(options),published_type_allocator_(*options.get_allocator()),ros_message_type_allocator_(*options.get_allocator())
{// 初始化内存分配器和事件回调
}

PublisherBase构造函数则进行RCL层的publisher初始化

PublisherBase::PublisherBase(rclcpp::node_interfaces::NodeBaseInterface * node_base,const std::string & topic,const rosidl_message_type_support_t & type_support,const rcl_publisher_options_t & publisher_options)
: node_base_(node_base),topic_(topic)
{// 创建rcl_publisher_t实例publisher_handle_ = std::shared_ptr<rcl_publisher_t>(new rcl_publisher_t, [node_handle](rcl_publisher_t * publisher) {if (rcl_publisher_fini(publisher, node_handle) != RCL_RET_OK) {RCLCPP_ERROR(/* ... */);}delete publisher;});*publisher_handle_.get() = rcl_get_zero_initialized_publisher();// 关键调用:初始化RCL层publisherrcl_ret_t ret = rcl_publisher_init(publisher_handle_.get(),node_base->get_rcl_node_handle(),&type_support,topic.c_str(),&publisher_options);if (ret != RCL_RET_OK) {// 错误处理}
}

2.3 rcl层

rcl_publisher_init 函数进一步处理:

rcl_ret_t
rcl_publisher_init(rcl_publisher_t * publisher,const rcl_node_t * node,const rosidl_message_type_support_t * type_support,const char * topic_name,const rcl_publisher_options_t * options
)
{// 参数验证和初始化// 向RMW层请求创建发布者// rmw_handle为rmw_publisher_t *类型publisher->impl->rmw_handle = rmw_create_publisher(rcl_node_get_rmw_handle(node),type_support,remapped_topic_name,&(options->qos),&(options->rmw_publisher_options));// 错误处理与返回值设置
}

2.4 rmw层(通过rmw_implementation)

此处进入rmw_implementation包的functions.cpp中,其中rmw_create_publisherrmw.h文件中定义的接口函数:

RMW_INTERFACE_FN(rmw_create_publisher,rmw_publisher_t *, nullptr,5, ARG_TYPES(const rmw_node_t *, const rosidl_message_type_support_t *, const char *,const rmw_qos_profile_t *, const rmw_publisher_options_t *))

这个宏展开后生成:

#define RMW_INTERFACE_FN(name, ReturnType, error_value, _NR, ...) \void * symbol_ ## name = nullptr; \ReturnType name(EXPAND(ARGS_ ## _NR(__VA_ARGS__))) \{ \CALL_SYMBOL( \name, ReturnType, error_value, ARG_TYPES(__VA_ARGS__), \EXPAND(ARG_VALUES_ ## _NR(__VA_ARGS__))); \}

CALL_SYMBOL宏进一步展开:

#define CALL_SYMBOL(symbol_name, ReturnType, error_value, ArgTypes, arg_values) \if (!symbol_ ## symbol_name) { \/* only necessary for functions called before rmw_init */ \//获取库中的函数符号symbol_ ## symbol_name = get_symbol(#symbol_name); \} \if (!symbol_ ## symbol_name) { \/* error message set by get_symbol() */ \return error_value; \} \typedef ReturnType (* FunctionSignature)(ArgTypes); \// 根据函数地址,调用加载的函数FunctionSignature func = reinterpret_cast<FunctionSignature>(symbol_ ## symbol_name); \return func(arg_values);

get_symbol 函数获取函数符号:

void *
get_symbol(const char * symbol_name)
{try {return lookup_symbol(get_library(), symbol_name);} catch (const std::exception & e) {RMW_SET_ERROR_MSG_WITH_FORMAT_STRING("failed to get symbol '%s' due to %s",symbol_name, e.what());return nullptr;}
}

2.5 加载和符号查找

关键的lookup_symbol函数负责从已加载的库中查找符号:

void *
lookup_symbol(std::shared_ptr<rcpputils::SharedLibrary> lib, const std::string & symbol_name)
{if (!lib) {if (!rmw_error_is_set()) {RMW_SET_ERROR_MSG("no shared library to lookup");}  // else assume library loading failedreturn nullptr;}if (!lib->has_symbol(symbol_name)) {try {std::string library_path = lib->get_library_path();RMW_SET_ERROR_MSG_WITH_FORMAT_STRING("failed to resolve symbol '%s' in shared library '%s'",symbol_name.c_str(), library_path.c_str());} catch (const std::exception & e) {RMW_SET_ERROR_MSG_WITH_FORMAT_STRING("failed to resolve symbol '%s' in shared library due to %s",symbol_name.c_str(), e.what());}return nullptr;}// 返回找到的函数指针return lib->get_symbol(symbol_name);
}

get_library()函数负责加载RMW实现库:

std::shared_ptr<rcpputils::SharedLibrary> get_library()
{if (!g_rmw_lib) {// 懒加载策略 - 首次使用时加载g_rmw_lib = load_library();}return g_rmw_lib;
}

2.6 具体DDS实现

rmw_publisher.cpp文件中,调用rmw_fastrtps_cpp::create_publisher函数进行publisher创建。最终,通过符号解析得到的函数指针指向特定DDS实现(如FastDDS、CycloneDDS)提供的具体rmw_create_publisher实现:

// 在FastDDS中的实现示例
rmw_publisher_t *
rmw_fastrtps_cpp::create_publisher(const CustomParticipantInfo * participant_info,const rosidl_message_type_support_t * type_supports,const char * topic_name,const rmw_qos_profile_t * qos_policies,const rmw_publisher_options_t * publisher_options,bool keyed,bool create_publisher_listener)
{rmw_publisher_t * publisher = rmw_fastrtps_cpp::create_publisher(participant_info,type_supports,topic_name,qos_policies,publisher_options,false,true);// 创建并返回rmw_publisher_t结构
}rmw_publisher_t *
rmw_fastrtps_cpp::create_publisher(const CustomParticipantInfo * participant_info,const rosidl_message_type_support_t * type_supports,const char * topic_name,const rmw_qos_profile_t * qos_policies,const rmw_publisher_options_t * publisher_options,bool keyed,bool create_publisher_listener)
{eprosima::fastdds::dds::Publisher * publisher = participant_info->publisher_;...
}

3. 层级交互总结

DDS层
实现层
动态加载层
中间件接口层
客户端库层
用户应用层
环境变量决定
环境变量决定
环境变量决定
环境变量决定
eProsima FastDDS
Eclipse CycloneDDS
RTI Connext DDS
rmw_fastrtps_shared_cpp
FastDDS共享实现
rmw_fastrtps_cpp
FastDDS C++实现
rmw_fastrtps_dynamic_cpp
FastDDS动态类型支持
rmw_cyclonedds_cpp
CycloneDDS实现
rmw_connextdds
Connext DDS实现
rmw_implementation
动态加载机制
根据RMW_IMPLEMENTATION
环境变量加载具体实现
rmw
定义中间件接口API
所有RMW实现必须遵循的
接口规范
rmw_dds_common
通用DDS功能
为所有基于DDS的
RMW实现提供共享功能
rclcpp层
C++客户端库
提供面向对象API
管理C++对象生命周期
rcl层
C语言客户端库
处理资源分配
错误处理和参数验证
用户代码
node->create_publisher(...)
  1. rclcpp层:提供面向对象的友好API,管理C++对象生命周期
  2. rcl层:提供C语言API,处理资源分配、错误处理和参数验证
  3. rmw层:定义中间件抽象接口,与具体DDS无关
  4. rmw_implementation层
    • 使用环境变量决定加载哪个RMW实现
    • 通过动态符号查找机制(lookup_symbol)获取函数指针
    • 通过函数指针转发调用到实际DDS实现
  5. 具体DDS实现:执行真正的DDS操作,与网络通信

4. 实际应用示例

在ROS 2系统中,可以通过环境变量轻松切换底层DDS实现:

# 使用FastDDS (默认)
export RMW_IMPLEMENTATION=rmw_fastrtps_cpp# 使用CycloneDDS
export RMW_IMPLEMENTATION=rmw_cyclonedds_cpp# 使用Connext DDS
export RMW_IMPLEMENTATION=rmw_connextdds# 查看当前使用的RMW实现
ros2 doctor --report | grep middleware

文章转载自:

http://Jauemr6y.nqyfm.cn
http://oStcXlEA.nqyfm.cn
http://0WNVqg3m.nqyfm.cn
http://cSyUl17i.nqyfm.cn
http://u0KA9KjH.nqyfm.cn
http://fW4xS018.nqyfm.cn
http://qR2ZRBcR.nqyfm.cn
http://Aaigo544.nqyfm.cn
http://WESyhUgd.nqyfm.cn
http://MD51PNQu.nqyfm.cn
http://1UIxpmXp.nqyfm.cn
http://FLIHr7VJ.nqyfm.cn
http://h8ukNTvj.nqyfm.cn
http://9x9P98Z3.nqyfm.cn
http://B0d3iXZw.nqyfm.cn
http://oXjGcywj.nqyfm.cn
http://egItwAfm.nqyfm.cn
http://aadxOo9M.nqyfm.cn
http://Ji6cCzwn.nqyfm.cn
http://6xx3Klo0.nqyfm.cn
http://tCS8Bcwk.nqyfm.cn
http://1sv9Xjli.nqyfm.cn
http://Hef6CDje.nqyfm.cn
http://s5A8C00K.nqyfm.cn
http://20JbOQry.nqyfm.cn
http://MGYP38CQ.nqyfm.cn
http://xdbzNbjb.nqyfm.cn
http://1gsaRK04.nqyfm.cn
http://VnW1zDTu.nqyfm.cn
http://gVac5fDm.nqyfm.cn
http://www.dtcms.com/wzjs/775835.html

相关文章:

  • 邢台集团网站建设费用网站建设与维护好学吗
  • 网站demo 工具wordpress yum
  • 淘宝优惠券微网站开发王也道长微信头像
  • 企业网站快速备案服务网站建设工作标准
  • 视频网站开发代码wordpress熊掌号百度自动提交
  • 谈谈网站建设创新问题创建网站宝典
  • 深圳建设网站公司哪儿济南兴田德润有活动吗网站的缩略图
  • 手机网站源文件蛋糕方案网站建设
  • 高性能网站建设指南 京东网站建设的销售术语
  • 毕业设计h5网站制作高新网站设计找哪家
  • 非商业组织的网站风格自己做一个网站难么
  • 自助手机网站建站软件网站建设赚钱项目
  • 西部数码网站源码公司网站开发项目
  • 做暧嗳xo小视频免费网站广州网站建设比较
  • 做橱窗设计的网站专业营销的网站建设公司
  • 衡阳市住房和城乡建设局官方网站网站建设项目经费的报告
  • 做音频主播的网站设计师用的软件有哪些
  • 怎么介绍网站的优缺点响应式的网站做优化好吗
  • 做器材的网站贵港网站设计
  • wordpress动漫网站模板广州做网站优化费用
  • 模版型网站wordpress frp穿透
  • ip域名查询网站入口邢台手机网站建设多少钱
  • 蓝色企业网站手机版织梦模板能自己制作图片的app
  • 律师网站建设模板freenom申请域名
  • 手机版网站与app网站跟app的区别
  • 做ctf的网站有哪些天津门户网站开发
  • 制作响应式网站内蒙古住房和城乡建设厅网站 工程建设管理
  • 建设银行 企业网站网站开发教程大全
  • 建设电子商务网站总体设计阶段上海建网站服务
  • 如何做一张图片的网站最好网站建设公司排名