io_context
  • Links
    • Rosindex
    • Repository
    • Bugtracker
  • C++ API
    • Class Hierarchy
    • File Hierarchy
    • Full C++ API
      • Namespaces
        • Namespace drivers
        • Namespace drivers::common
      • Classes and Structs
        • Struct thread_group
        • Class IoContext
      • Functions
        • Function drivers::common::from_msg(const std_msgs::msg::Int8::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::Int16::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::Int32::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::Int64::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::UInt8::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::UInt16::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::UInt32::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::UInt64::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::Float32::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::Float64::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const std_msgs::msg::UInt8MultiArray::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::from_msg(const udp_msgs::msg::UdpPacket::SharedPtr&, std::vector<uint8_t>&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::Int8&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::Int16&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::Int32&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::Int64&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::UInt8&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::UInt16&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::UInt32&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::UInt64&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::Float32&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::Float64&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, std_msgs::msg::UInt8MultiArray&, const size_t&)
        • Function drivers::common::to_msg(const std::vector<uint8_t>&, udp_msgs::msg::UdpPacket&)
      • Directories
        • Directory include
        • Directory io_context
        • Directory msg_converters
      • Files
        • File common.hpp
        • File converters.hpp
        • File io_context.hpp
        • File std_msgs.hpp
        • File udp_msgs.hpp
  • Standard Documents
    • PACKAGE
    • CHANGELOG
      • Changelog for package io_context
        • 1.2.0 (2022-03-20)
        • 1.1.0 (2022-03-20)
        • 1.0.1 (2021-08-30)
        • 0.0.6 (2020-08-27)
        • 0.0.5 (2020-07-16)
        • 0.0.4 (2019-12-12)
        • 0.0.3 (2019-08-21)
        • 0.0.2 (2019-08-19)
    • README
  • Index
io_context
  • C++ API
  • File udp_msgs.hpp
  • View page source

File udp_msgs.hpp

↰ Parent directory (include/msg_converters)

Contents

  • Definition (include/msg_converters/udp_msgs.hpp)

  • Includes

  • Included By

  • Namespaces

  • Functions

Definition (include/msg_converters/udp_msgs.hpp)

  • Program Listing for File udp_msgs.hpp

Includes

  • algorithm

  • udp_msgs/msg/udp_packet.hpp

  • vector

Included By

  • File converters.hpp

Namespaces

  • Namespace drivers

  • Namespace drivers::common

Functions

  • Function drivers::common::from_msg(const udp_msgs::msg::UdpPacket::SharedPtr&, std::vector<uint8_t>&)

  • Function drivers::common::to_msg(const std::vector<uint8_t>&, udp_msgs::msg::UdpPacket&)

Previous Next

© Copyright The <io_context> Contributors. License: Apache License 2.0.

Built with Sphinx using a theme provided by Read the Docs.