mia_hand_driver
rel 1.0.0
|
Go to the documentation of this file.
10 #ifndef MIA_HAND_SERIAL_PORT_H
11 #define MIA_HAND_SERIAL_PORT_H
13 #include "libserial/SerialPort.h"
43 SerialPort(std::mutex* p_finger_data_mtx, std::mutex* p_connection_mtx,
44 bool* p_is_connected);
55 bool open(uint16_t port_num);
91 #endif // MIA_HAND_SERIAL_PORT_H
SerialPort(std::mutex *p_finger_data_mtx, std::mutex *p_connection_mtx, bool *p_is_connected)
Class destructor.
bool close()
Close the serial port.
Struct containing all info that could regard a Mia hand motor.
void sendCommand(const std::string &command)
Send a command to the Mia hand attached to the serial port.
~SerialPort()
Class destructor.
bool open(uint16_t port_num)
Open a serial port.
std::mutex * p_connection_mtx_
Class to handle a serial port and its serial communication protocol.
void parseStream(FingerSerialInfo &thumb, FingerSerialInfo &index, FingerSerialInfo &mrl, bool &is_checking_on)
Parse message received from the Mia hand.
std::mutex serial_write_mtx_
struct mia_hand::FingerSerialInfo FingerSerialInfo
Struct containing all info that could regard a Mia hand motor.
std::string stream_msg_
Message received from the Mia hand.
std::mutex * p_finger_data_mtx_