CHANGELOG

Changelog for package serial_driver

1.2.0 (2022-03-20)

  • Disable broken test.

  • Fix linter errors.

  • Contributors: WhitleySoftwareServices

1.1.0 (2022-03-20)

  • Support serial_break (#76) * Support serial_break * Add protection to serial break and unit tests

  • Fix the converter Converter between std_msgs::msg::UInt8MultiArray and std::vector<uint8_t> (#73) * example_interfaces is redundant as std_msgs includes UInt8MultiArray * udp_msgs.hpp should not include “converters.hpp” * Fix the converter std_msgs::msg::UInt8MultiArray <-> std::vector<uint8_t>

  • Add support for Foxy (#68) * Add support for Foxy * Use same API signature for all ROS distros

  • Contributors: ChenJun, Esteve Fernandez, RFRIEDM-Trimble

1.0.1 (2021-08-30)

  • Remove deprecated api from galactic (#57)

  • Serial driver debugs (#56) * debugged message conversion debugged serial bridge segfault (publisher accessed before initialized) * refactored message conversion

  • update READMEs for each package (#54) * update READMEs for each package * add more to readme, renamed config to params

  • Port udp_driver Changes to serial_driver (#47) * Adding SerialPort and framework for SerialDriver. * Adding SerialDriver * Adding SerialBridgeNode * Remove serial_driver_node and tests * Create new tests for serial_port and serial_driver * Changing signature of from_msg for example_interfaces * [serial_driver] Adding missing function definition * [serial_driver] Adding example params and launch files * Trying to apease flake8 * Fixing allocation snafu * [serial_driver] Replacing MutBuffer with std::vector<uint8_t> * [serial_driver] Fix typo * [serial_driver] Make launch file more reliable * [serial_driver] Fix error message * [serial_driver] Fix typo * [serial_driver] Shorten node name

  • Export ASIO definitions (#44)

  • Enforce C++14. Do not duplicate compiler flags (#45)

  • Deduplicate ASIO CMake module (#43) * Added ASIO CMake module * Use asio_cmake_module

  • Fix copyright years (#41)

  • Removed Boost (#39) * Removed Boost * Do not depend on Boost at all * Added cmath header * Fix linting warning * Added ASIO_STANDALONE to more units * Call stop on io_service * Fix dependency * Export asio as a downstream dependency * Remove more boost references * Force non-Boost version of ASIO * Force non-Boost version of ASIO * Ignore result to avoid compiler warning

  • remove autoware namespace (#35) * remove autoware namespace * move msgs namespace to utils

  • Make Nodes Component-Compatible (#22) * Making constructors for SerialDriverNode component-compatible. * Making constructors for UdpDriverNode component-compatible.

  • Contributors: Daisuke Nishimatsu, Esteve Fernandez, Evan Flynn, Haoru Xue, Joshua Whitley

0.0.6 (2020-08-27)

  • Uncrustify fixes.

  • Remove lifecycle references (#19)

  • Fixing boost dependency. (#18)

  • Contributors: Esteve Fernandez, Joshua Whitley

0.0.5 (2020-07-16)

  • Remove Autoware.AUTO Dependencies (#15) * Removing autoware dependencies. * Fixing linting errors. * Addressing review feedback.

  • Be specific about which parts of Boost are necessary (#10) * serial: be specific about Boost dependency. * udp: be specific about Boost dependency.

  • Contributors: G.A. vd. Hoorn, Joshua Whitley

0.0.4 (2019-12-12)

  • Making serial_driver version number consistent with repo.

  • Initial commit of serial_driver.

  • Contributors: Joshua Whitley

0.0.3 (2019-08-21)

0.0.2 (2019-08-19)