6 #include <boost/asio/write.hpp>
7 #include <boost/asio/read.hpp>
14 std::array<std::uint8_t, 4> INITIALIZE { 1, 0, 0, 0, };
15 std::array<std::uint8_t, 4> SET_POSITIONS { 2, 0, 0, 0 };
19 std::ostream &
operator <<(std::ostream &o,
const std::vector<T> &data)
21 for (
auto it = data.cbegin(); it != data.cend(); ++it)
23 o << static_cast<int>(*it) <<
" ";
40 const int fd =
::open(path.c_str(), O_RDWR | O_NONBLOCK);
43 throw std::runtime_error(strerror(errno));
48 struct termios settings;
49 tcgetattr(fd, &settings);
51 cfsetispeed(&settings, 115200);
52 cfsetospeed(&settings, 115200);
53 settings.c_cflag &= ~PARENB;
54 settings.c_cflag &= ~CSTOPB;
55 settings.c_cflag &= ~CSIZE;
56 settings.c_cflag |= CS8;
57 settings.c_cflag &= ~CRTSCTS;
58 settings.c_cflag |= CREAD | CLOCAL;
59 settings.c_iflag &= ~(IXON | IXOFF | IXANY);
60 settings.c_lflag &= ~(ICANON | ECHO | ECHOE | ISIG);
61 settings.c_oflag &= ~OPOST;
63 tcsetattr(fd, TCSANOW, &settings);
64 if (tcsetattr(fd, TCSAFLUSH, &settings) < 0) {
65 perror(
"init_serialport: Couldn't set term attributes");
69 return std::shared_ptr<SerialDevice>(
new SerialDevice(boost::asio::posix::stream_descriptor(context, fd), path));
77 , stateBuffer_(nullptr)
89 boost::system::error_code ec;
96 std::cout <<
"Initialize " <<
name_ << std::endl;
118 if (strlen(msg->_1) > 0) ret.joints.push_back(InitializationInfo::JointInfo {
122 if (strlen(msg->_2) > 0) ret.joints.push_back(InitializationInfo::JointInfo {
134 void SerialDevice::setPositions(
const double *
const positions,
const std::size_t length)
137 msg.
positions[0] = length > 0 ? positions[0] : 0;
138 msg.
positions[1] = length > 1 ? positions[1] : 0;
139 msg.
positions[2] = length > 2 ? positions[2] : 0;
150 auto seconds = std::chrono::duration_cast<std::chrono::seconds>(std::chrono::system_clock::now().
time_since_epoch()).count();
154 using namespace std::chrono;
156 const auto time = duration_cast<microseconds>(system_clock::now().
time_since_epoch());
164 void SerialDevice::set(
const double *
const positions,
const double *
const velocities,
const std::size_t length)
167 msg.
positions[0] = length > 0 ? positions[0] : 0;
168 msg.
positions[1] = length > 1 ? positions[1] : 0;
169 msg.
positions[2] = length > 2 ? positions[2] : 0;
170 msg.
velocities[0] = length > 0 ? velocities[0] : 0;
171 msg.
velocities[1] = length > 1 ? velocities[1] : 0;
172 msg.
velocities[2] = length > 2 ? velocities[2] : 0;
189 const auto start = std::chrono::system_clock::now();
195 const auto end = std::chrono::system_clock::now();
205 std::array<std::uint8_t, 256> buffer;
206 boost::system::error_code ec;
207 size_t count = boost::asio::read(
fd_, boost::asio::buffer(buffer), boost::asio::transfer_at_least(1), ec);
208 if (count == 0)
return;
215 std::cout <<
name_ <<
": " << msg->message << std::endl;