CHANGELOG

Changelog for package rmw_fastrtps_shared_cpp

8.4.0 (2024-04-09)

  • Allow pkcs11 when calling rmw_dds_common::get_security_files. (#565) Co-authored-by: Miguel Company <MiguelCompany@eprosima.com>

  • Add tracepoint for publish/subscribe serialized_message (#748) * Add: tracepoint for generic pub/sub * Fix: correspond to PR 454 * Fix: change write to write_to_timestamp ———

  • Contributors: IkerLuengo, h-suzuki-isp

8.3.0 (2024-03-28)

  • Support Fast CDR v2 (#746) * Require fastcdr version 2 * Changes to build rmw_fastrtps_shared_cpp * Changes to build rmw_fastrtps_cpp * Changes to build rmw_fastrtps_dynamic_cpp

  • Remove an unnecessary constructor. (#743) We can just use brace initialization here, and this allows us to side-step an uncrustify issue with the constructor.

  • Contributors: Chris Lalancette, Miguel Company

8.2.0 (2024-01-24)

  • Add timestamp to rmw_publish tracepoint (#694)

  • Switch to Unix line endings. (#736)

  • Contributors: Chris Lalancette, Christopher Wecht

8.1.0 (2023-12-26)

  • Switch to target_link_libraries for linking. (#734)

  • Contributors: Chris Lalancette

8.0.0 (2023-11-06)

  • Quiet compiler warning in Release mode. (#730)

  • avoid using dds common public mutex directly (#725)

  • Contributors: Chen Lihui, Chris Lalancette

7.6.0 (2023-10-04)

  • Add rmw_count clients,services impl (#641)

  • Contributors: Minju, Lee

7.5.0 (2023-09-07)

  • Switch to using rclcpp::unique_lock. (#712)

  • Use DataWriter Qos to configure max_blocking_time on rmw_send_response (#704)

  • Contributors: Chris Lalancette, Miguel Company

7.4.0 (2023-08-21)

  • Clear out errors once we have handled them. (#701)

  • Instrument loaned message publication code path (#698)

  • Add in a missing data_reader check when creating subscription. (#697)

  • Contributors: Chris Lalancette, Christophe Bedard

7.3.0 (2023-06-12)

  • Use TRACETOOLS_ prefix for tracepoint-related macros (#686)

  • typo fix. (#693)

  • Contributors: Christophe Bedard, Tomoya Fujita

7.2.1 (2023-05-11)

  • address clang nightly build error. (#689)

  • Check for errors while doing an rmw_discovery_options_copy. (#690)

  • Contributors: Chris Lalancette, Tomoya Fujita

7.2.0 (2023-04-27)

7.1.1 (2023-04-12)

  • Fix matched event issues (#683)

  • Contributors: Miguel Company

7.1.0 (2023-04-12)

  • Dynamic Subscription (BONUS: Allocators): rmw_fastrtps (#687)

  • Check for triggered guard conditions before waiting (#685)

  • Runtime Interface Reflection: rmw_fastrtps (#655)

  • [rmw_fastrtps] Improve handling of dynamic discovery (#653)

  • Type hash distribution in discovery (rep2011) (#671)

  • Implement matched event (#645)

  • Implement inconsistent topic event (#654)

  • Update all rmw_fastrtps packages to C++17. (#674)

  • Contributors: Barry Xu, Chris Lalancette, Emerson Knapp, Geoffrey Biggs, Michael Carroll, methylDragon

7.0.0 (2023-02-14)

  • Rewrite how Topics are tracked in rmw_fastrtps_cpp. (#669)

  • Delay lock on message callback setters (#657)

  • Make sure to add semicolons to the CHECK_TYPE_IDENTIFIER_MATCH. (#658)

  • Allow loaned messages without data-sharing (#568)

  • Fix incoherent dissociate_writer to dissociate_reader (#647) (#649)

  • [rolling] Update maintainers - 2022-11-07 (#643)

  • Contributors: Audrow Nash, Chris Lalancette, Miguel Company, Oscarchoi

6.5.0 (2022-11-02)

  • Remove duplicated code (#637)

  • Call callbacks only if unread count > 0 (#634)

  • Add rmw_get_gid_for_client impl (#631)

  • Contributors: Barry Xu, Brian, mauropasse

6.4.0 (2022-09-13)

  • Use Fast-DDS Waitsets instead of listeners (#619)

  • Take all available samples on service/client on_data_available. (#616)

  • Revert “add line feed for RCUTILS_SAFE_FWRITE_TO_STDERR (#608)” (#612)

  • add line feed for RCUTILS_SAFE_FWRITE_TO_STDERR (#608)

  • Contributors: Miguel Company, Ricardo González, Tomoya Fujita

6.3.0 (2022-05-03)

6.2.1 (2022-03-28)

  • Address linter waning for windows. (#592)

  • Add pub/sub init, publish and take instrumentation using tracetools (#591)

  • Add content filter topic feature (#513)

  • Add sequence numbers to message info structure (#587)

  • Contributors: Chen Lihui, Christophe Bedard, Ivan Santiago Paunovic, Tomoya Fujita

6.2.0 (2022-03-01)

  • Add EventsExecutor (#468)

  • Complete events support (#583)

  • Install headers to include/${PROJECT_NAME} (#578)

  • Change default to synchronous (#571)

  • Contributors: Audrow Nash, Miguel Company, Shane Loretz, iRobot ROS

6.1.2 (2022-01-14)

  • Fix cpplint error (#574)

  • Contributors: Jacob Perron

6.1.1 (2021-12-17)

  • Fixes for uncrustify 0.72 (#572)

  • Contributors: Chris Lalancette

6.1.0 (2021-11-19)

  • Add client/service QoS getters. (#560)

  • Fix QoS depth settings for clients/service being ignored. (#564)

  • Contributors: Chen Lihui, mauropasse

6.0.0 (2021-09-15)

  • Update rmw_context_impl_t definition. (#558)

  • Update the LoanManager to do internal locking. (#552)

  • Contributors: Chris Lalancette, Michel Hidalgo

5.2.2 (2021-08-09)

  • Pass the CRL down to Fast-DDS if available. (#546)

  • Contributors: Chris Lalancette

5.2.1 (2021-06-30)

  • Use the new rmw_dds_common::get_security_files (#544)

  • Support for SubscriptionOptions::ignore_local_publications (#536)

  • Change links from index.ros.org -> docs.ros.org (#539)

  • Contributors: Chris Lalancette, Jose Antonio Moral

5.2.0 (2021-06-04)

  • Add rmw_publisher_wait_for_all_acked support. (#519)

  • Contributors: Barry Xu

5.1.0 (2021-05-12)

  • Loan messages implementation (#523) * Added is_plain_ attribute to base TypeSupport. * Added new methods to base TypeSupport. * Implementation of rmw_borrow_loaned_message. * Implementation of rmw_return_loaned_message_from_publisher. * Enable loan messages on publishers of plain types. * Implementation for taking loaned messages. * Enable loan messages on subscriptions of plain types.

  • Export rmw_dds_common as an rmw_fastrtps_shared_cpp dependency (#530)

  • Update includes after rcutils/get_env.h deprecation (#529)

  • Contributors: Christophe Bedard, Michel Hidalgo, Miguel Company

5.0.0 (2021-04-06)

  • Refactor to use DDS standard API (#518)

  • Unique network flows (#502)

  • updating quality declaration links (re: ros2/docs.ros2.org#52) (#520)

  • Contributors: Miguel Company, shonigmann

4.5.0 (2021-03-18)

  • Take and return new RMW_DURATION_INFINITE correctly (#515)

  • Contributors: Emerson Knapp

4.4.0 (2021-03-01)

  • Add RMW function to check QoS compatibility (#511)

  • Capture cdr exceptions (#505)

  • Contributors: Jacob Perron, Miguel Company

4.3.0 (2021-01-25)

4.2.0 (2020-12-10)

  • Make sure to lock the mutex protecting client_endpoints_. (#492)

  • Contributors: Chris Lalancette

4.1.0 (2020-12-08)

  • Use interface whitelist for localhost only (#476)

  • Make use of error return value in decrement_context_impl_ref_count (#488)

  • Remove unnecessary includes (#487)

  • Use new time_utils function to limit rmw_time_t values to 32-bits (#485)

  • New environment variable to change easily the publication mode (#470)

  • Remove unused headers MessageTypeSupport.hpp and ServiceTypeSupport.hpp (#481)

  • Contributors: Jacob Perron, José Luis Bueno López, Michael Jeronimo, Miguel Company, Stephen Brawner

4.0.0 (2020-10-22)

  • Discriminate when the Client has gone from when the Client has not completely matched (#467) * Workaround when the client is gone before server sends response * Change add to the map to listener callback

  • Update the package.xml files with the latest Open Robotics maintainers (#459)

  • Update Quality Declarations and READMEs (#455) * Add QD links for dependencies to rmw_fastrtps_shared_cpp QD. * Provide external dependencies QD links. * Update rmw_fastrtps_shared_cpp QD: Fast DDS * Update README rmw_fastrtps_shared_cpp to QL2

  • Contributors: JLBuenoLopez-eProsima, Jaime Martin Losa, José Luis Bueno López, Michael Jeronimo

3.1.4 (2020-10-02)

  • Perform fault injection in all creation/destruction APIs. (#453)

  • Ensure rmw_destroy_node() completes despite run-time errors. (#458)

  • Handle too large QoS queue depths. (#457)

  • Update rmw_fastrtps_cpp and rmw_fastrtps_shared_cpp QDs to QL2. (#456)

  • Contributors: Michel Hidalgo

3.1.3 (2020-09-29)

  • checked client implementation and return RMW_RET_INCORRECT_RMW_IMPLEMENTATION (#451)

  • Update service/client request/response API error returns (#450)

  • Contributors: Alejandro Hernández Cordero, Jose Tomas Lorente

3.1.2 (2020-09-25)

  • Updated publisher/subscription allocation and wait set API return codes (#443)

  • Added rmw_logging tests (#442)

  • Contributors: Alejandro Hernández Cordero

3.1.1 (2020-09-24)

  • Add tests for RMW QoS to DDS attribute conversion. (#449)

  • Make service/client construction/destruction implementation compliant (#445)

  • Contributors: Michel Hidalgo

3.1.0 (2020-09-23)

  • Inject faults on __rmw_publish() and run_listener_thread() call. (#441)

  • Update gid API return codes. (#440)

  • Update graph API return codes. (#436)

  • Contributors: Michel Hidalgo

3.0.0 (2020-09-18)

  • Update rmw_take_serialized() and rmw_take_with_message_info() error returns (#435)

  • Update rmw_take() error returns (#432)

  • Update rmw_publish() error returns (#430)

  • Update rmw_publish_serialized_message() error returns (#431)

  • Contributors: Jose Tomas Lorente, Lobotuerk

2.6.0 (2020-08-28)

  • Improve __rmw_create_wait_set() implementation. (#427)

  • Ensure compliant matched pub/sub count API. (#424)

  • Ensure compliant publisher QoS queries. (#425)

  • Fix memory leak that wait_set might be not destoryed in some case. (#423)

  • Contributors: Chen Lihui, Michel Hidalgo

2.5.0 (2020-08-07)

  • Avoid unused identifier variable warnings. (#422)

  • Fix trying to get topic data that was already removed. (#417)

  • Contributors: Chen Lihui, Michel Hidalgo

2.4.0 (2020-08-06)

  • Ensure compliant subscription API. (#419)

  • Use package path to TypeSupport.hpp headers in ServiceTypeSupport and MessageTypeSupport (#415) Use package in path to TypeSupport header for ServiceTypeSupport/MessageTypeSupport

  • Contributors: Jose Luis Rivero, Michel Hidalgo

2.3.0 (2020-07-30)

  • Ensure compliant publisher API. (#414)

  • Contributors: Michel Hidalgo

2.2.0 (2020-07-22)

  • Set context actual domain id (#410)

  • Contributors: Ivan Santiago Paunovic

2.1.0 (2020-07-20)

  • Add missing thread-safety annotation in ServicePubListener (#409)

  • Ensure compliant node construction/destruction API. (#408)

  • Contributors: Michel Hidalgo

2.0.0 (2020-07-08)

  • Update Quality Declarations to QL3. (#404)

  • Contributors: Michel Hidalgo

1.1.0 (2020-06-29)

  • Do not use string literals as implementation identifiers in tests. (#402)

  • Ensure compliant init options API implementations. (#399)

  • Finalize context iff shutdown. (#396)

  • Handle RMW_DEFAULT_DOMAIN_ID. (#394)

  • Make service wait for response reader (#390)

  • Contributors: Michel Hidalgo, Miguel Company

1.0.1 (2020-06-01)

  • Add Security Vulnerability Policy pointing to REP-2006 (#389)

  • Do not compile assert death tests in Release builds (#393)

  • Add test coverage for name mangling and namespacing-specific API (#388)

  • Add test coverage for GUID utilities (#387)

  • Drop unused TopicCache sources (#386)

  • Add test coverage for rmw_init_options API (#385)

  • Update QDs for 1.0 (#383)

  • Contributors: Chris Lalancette, Michel Hidalgo, Stephen Brawner

1.0.0 (2020-05-12)

  • Remove API related to manual by node liveliness. (#379)

  • Update quality declarations on feature testing. (#380)

  • Contributors: Ivan Santiago Paunovic, Michel Hidalgo

0.9.1 (2020-05-08)

  • Fill service_info timestamps from sample_info (#378)

  • Fix unused variabled warning (#377)

  • Add basic support for security logging plugin (#362)

  • Add package READMEs and QUALITY_DECLARATION files (#375)

  • Added doxyfiles (#372)

  • Contributors: Alejandro Hernández Cordero, Ingo Lütkebohle, Jacob Perron, Kyle Fazzari, brawner

0.9.0 (2020-04-28)

  • Feature/services timestamps. (#369)

  • Add support for taking a sequence of messages. (#366)

  • Fill message_info timestamp. (#368)

  • Export targets in a addition to include directories / libraries. (#371)

  • Support for API break on Fast RTPS 2.0. (#370)

  • security-context -> enclave. (#365)

  • Switch to one Participant per Context. (#312)

  • Correct error message when event is not supported. (#358)

  • Add rmw_*_event_init() functions. (#354)

  • Fixing type support C/CPP mix on rmw_fastrtps_dynamic_cpp. (#350)

  • Fix build warning in Ubuntu Focal. (#346)

  • Change rmw_topic_endpoint_info_array.count to .size. (#348)

  • Code style only: wrap after open parenthesis if not in one line. (#347)

  • Fix unprotected use of mutex-guarded variable. (#345)

  • Passing down type support information (#342)

  • Implement functions to get publisher and subcription informations like QoS policies from topic name. (#336)

  • Contributors: Dirk Thomas, Emerson Knapp, Ingo Lütkebohle, Ivan Santiago Paunovic, Jaison Titus, Miaofei Mei, Michael Carroll, Miguel Company, Mikael Arguedas

0.8.1 (2019-10-23)

  • Restrict traffic to localhost only if env var is provided (#331)

  • Added new functions which can be used to get rmw_qos_profile_t from WriterQos and ReaderQos (#328)

  • Renamed dds_qos_to_rmw_qos to dds_attributes_to_rmw_qos (#330)

  • Contributors: Brian Marchi, jaisontj

0.8.0 (2019-09-25)

  • Correct error message (#320)

  • Return specific error code when node is not found (#311)

  • Correct linter failure (#318)

  • Fix bug in graph API by node (#316)

  • fix method name change from 1.8.1->1.9.0 (#302)

  • Add missing lock guards for discovered_names and discovered_namespaces (#301)

  • Add function for getting clients by node (#293)

  • Enable manual_by_node and node liveliness assertion (#298)

  • Enable assert liveliness on publisher. (#296)

  • Use rcpputils::find_and_replace instead of std::regex_replace (#291)

  • Fix a comparison with a sign mismatch (#288)

  • Implement get_actual_qos() for subscriptions (#287)

  • add missing qos setings in get_actual_qos() (#284)

  • Fix ABBA deadlock.

  • Contributors: Chris Lalancette, Emerson Knapp, Jacob Perron, M. M, Scott K Logan, William Woodall, ivanpauno

0.7.3 (2019-05-29)

  • Protection of discovered_names and discovered_namespaces (#283)

  • Disable all liveliness until it is actually supported (#282)

  • Contributors: Emerson Knapp, MiguelCompany

0.7.2 (2019-05-20)

  • fix log_debug typo in rmw_count (#279)

  • Fastrtps18 event callbacks policies (#275)

  • Centralize topic name creation logic and update to match FastRTPS 1.8 API (#272)

  • Contributors: 1r0b1n0, Emerson Knapp, Nick Burek

0.7.1 (2019-05-08)

  • Support arbitrary message namespaces (#266)

  • Set more correct return values for unimplemented features (#276)

  • Add qos interfaces with no-op (#271)

  • Updates for preallocation API. (#274)

  • Fix logging in rmw_node_info_and_types.cpp (#273)

  • Contributors: Emerson Knapp, Jacob Perron, Michael Carroll, Ross Desmond, Thomas Moulard

0.7.0 (2019-04-13)

  • Thread safety annotation - minimally intrusive first pass (#259)

  • Add function to get publisher actual qos settings (#267)

  • Fixed race condition between taking sample and updating counter. (#264)

  • Fix cpplint error

  • change count type to size_t to avoid warning (#262)

  • update listener logic for accurate counting (#262)

  • Make sure to include the C++ headers used by these headers. (#256)

  • pass context to wait set and fini context (#252)

  • Improve service_is_available logic to protect that client is waiting forever (#238)

  • Merge pull request #250 from ros2/support_static_lib

  • use namespace_prefix from shared package

  • make namespace_prefix header public

  • Use empty() to check for an empty string (#247)

  • We can compare a std::string with a const char* using operator==, simplifies the code (#248)

  • Use empty() instead of size() to check if a vector/map contains elements and fixed some incorrect logging (#245)

  • Fix guard condition trigger error (#235)

  • Contributors: Chris Lalancette, Dirk Thomas, DongheeYe, Emerson Knapp, Jacob Perron, Johnny Willemsen, Ricardo González, William Woodall, ivanpauno

0.6.1 (2018-12-06)

  • Add topic cache object for managing topic relations (#236)

  • Fix lint: remove trailing whitespace (#244)

  • Fastrtps 1.7.0 (#233)

  • RMW_FastRTPS configuration from XML only (#243)

  • Methods to retrieve matched counts on pub/sub (#234)

  • use uint8_array (#240)

  • Contributors: Jacob Perron, Juan Carlos, Karsten Knese, Michael Carroll, MiguelCompany, Ross Desmond

0.6.0 (2018-11-16)

  • use new error handling API from rcutils (#231)

  • Add semicolons to all RCLCPP and RCUTILS macros. (#229)

  • separating identity and permission CAs (#227)

  • Include node namespaces in get_node_names (#224)

  • allow builtin reader/writer to reallocate memory if needed (#221)

  • Improve runtime performance of rmw_count_XXX functions (#216) (#217)

  • Merge pull request #218 from ros2/pr203

  • Refs #3061. Leaving common code only on rmw_fastrtps_shared_cpp.

  • Refs #3061. Package rmw_fastrtps_cpp copied to rmw_fastrtps_shared_cpp.

  • Contributors: Chris Lalancette, Dirk Thomas, Guillaume Autran, Michael Carroll, Miguel Company, Mikael Arguedas, William Woodall

0.5.1 (2018-06-28)

0.5.0 (2018-06-23)

0.4.0 (2017-12-08)