Classes | Typedefs | Functions
clober_serial.hpp File Reference
#include <chrono>
#include <string>
#include <bitset>
#include <boost/lexical_cast.hpp>
#include <boost/algorithm/string.hpp>
#include <thread>
#include <memory>
#include <serial/serial.h>
#include "clober_utils.hpp"
#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
#include <geometry_msgs/TransformStamped.h>
#include <nav_msgs/Odometry.h>
#include <clober_msgs/Feedback.h>
#include <tf2/LinearMath/Quaternion.h>
#include <tf2_ros/transform_broadcaster.h>
Include dependency graph for clober_serial.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  CloberSerial
 
struct  ControllerState
 
struct  Encoder
 
struct  MotorCommand
 
struct  MotorState
 
struct  VehicleConfig
 

Typedefs

using duration = std::chrono::nanoseconds
 

Functions

const string eol ("\r")
 
const size_t max_line_length (128)
 

Typedef Documentation

◆ duration

using duration = std::chrono::nanoseconds

Definition at line 26 of file clober_serial.hpp.

Function Documentation

◆ eol()

const string eol ( "\r"  )

◆ max_line_length()

const size_t max_line_length ( 128  )


clober_serial
Author(s):
autogenerated on Wed Mar 2 2022 00:01:24