robotont_driver
0.1
C++ API
Class Hierarchy
File Hierarchy
Full C++ API
Namespaces
Namespace drivers
Namespace drivers::common
Namespace rclcpp
Namespace robotont
Namespace std
Namespace std::chrono_literals
Classes and Structs
Struct DriverException
Struct thread_group
Class IoContext
Class Driver
Class Hardware
Class PluginBase
Class PluginBatState
Class PluginLedModule
Class PluginMotors
Class PluginOdom
Class PluginRange
Defines
Define LED_HPP
Typedefs
Typedef robotont::BatStatePtr
Typedef robotont::HardwarePtr
Typedef robotont::LedModulePtr
Typedef robotont::MotorsPtr
Typedef robotont::OdomPtr
Typedef robotont::PluginBasePtr
Typedef robotont::RobotontPacket
Directories
Directory include
Directory io_context
Directory robotont_driver
Files
File common.hpp
File driver.hpp
File driver_exception.hpp
File hardware.hpp
File io_context.hpp
File plugin_base.hpp
File plugin_bat_state.hpp
File plugin_led_module.hpp
File plugin_motors.hpp
File plugin_odom.hpp
File plugin_range.hpp
File robotont_driver.hpp
Standard Documents
CHANGELOG
Changelog for package robotont_driver
0.1.4 (2024-05-19)
0.1.2 (2024-03-18)
0.1.1 (2024-03-18)
LICENSE
PACKAGE
README
robotont_driver
1. Installing and starting the driver from ROS distro
2. Installing and starting the driver using source code
3. Moving the robot
4. Available plugins
Index
robotont_driver
C++ API
Class Hardware
View page source
Class Hardware
Defined in
File hardware.hpp
Class Documentation
class
Hardware
Public Functions
Hardware
(
rclcpp
::
Node
::
SharedPtr
node
)
~Hardware
(
)
void
read
(
)
void
cmd_vel_callback
(
const
geometry_msgs
::
msg
::
Twist
::
SharedPtr
cmd_vel_msg
)
void
get_params
(
)
void
receive_callback
(
const
std
::
vector
<
uint8_t
>
&
buffer
,
const
size_t
&
bytes_transferred
)
void
subscriber_callback
(
std
::
string
send_packet
)
void
get_packet
(
std
::
vector
<
RobotontPacket
>
&
driver_packets
)