io_context
1.2
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
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)
PACKAGE
README
Index
io_context
C++ API
Class IoContext
View page source
Class IoContext
Defined in
File io_context.hpp
Class Documentation
class
IoContext
Public Functions
IoContext
(
)
explicit
IoContext
(
size_t
threads_count
)
~IoContext
(
)
IoContext
(
const
IoContext
&
)
=
delete
IoContext
&
operator
=
(
const
IoContext
&
)
=
delete
asio
::
io_service
&
ios
(
)
const
bool
isServiceStopped
(
)
uint32_t
serviceThreadCount
(
)
void
waitForExit
(
)
template
<
class
F
>
inline
void
post
(
F
f
)