Quori.cpp
Go to the documentation of this file.
1 #include "Quori.hpp"
2 
3 #include <std_msgs/Float32.h>
4 
5 #include <iostream>
6 #include <chrono>
7 
8 
9 using namespace quori_controller;
10 
11 #define PI 3.1415927
12 #define TAU 6.2831853
13 #define WHEEL_RADIUS 0.075
14 
16 
17 Quori::Quori(ros::NodeHandle &nh, const std::vector<SerialDevice::Ptr> &devices)
18  : nh_(nh)
19  , base_vel_pub_(nh_.advertise<geometry_msgs::Vector3>("/quori/base/cmd_diff", 1))
20  , base_holo_vel_pub_(nh_.advertise<geometry_msgs::Vector3>("/quori/base/cmd_holo", 1))
21  , base_offset_pub_(nh_.advertise<std_msgs::Float32>("/quori/base/cmd_offset", 1))
22  , base_vel_status_(nh_.subscribe("/quori/base/vel_status", 1, &Quori::on_base_vel_status_, this))
23  , base_turret_pos_(nh_.subscribe("/quori/base/pos_status", 1, &Quori::on_base_turret_pos_, this))
24  , devices_(devices)
25  , max_device_joints_(0)
26  , device_joint_buffer_(nullptr)
27  , base_offset_(0.0)
28 {
29  ros::NodeHandle pnh("~");
30 
31  base_offset_ = pnh.param("base_offset", base_offset_);
32 
33  // Iterate through each serial device (Arduino) we've been given
34  for (auto it = devices_.cbegin(); it != devices_.cend(); ++it)
35  {
36  // Initialize the serial connection
37  SerialDevice::InitializationInfo info = (*it)->initialize();
38 
39  std::cout << (*it)->getName() << ":" << std::endl;
40 
42 
43  std::size_t last_index = joints_.size() - 1;
44 
45  std::vector<std::size_t> device_joint_indices;
46  // Iterate through the joints this serial device exposes
47  for (auto jit = info.joints.cbegin(); jit != info.joints.cend(); ++jit)
48  {
49  const std::string &joint_name = jit->name;
50  const Joint::Mode &joint_mode = jit->mode;
51 
52  std::cout << joint_name << std::endl;
53 
54  // Create a memory region for its state and command
55  joints_.push_back(std::make_shared<Joint>());
56 
57  double home_cmd = 0.0;
58  pnh.param("home_cmds/" + joint_name, home_cmd, home_cmd);
59 
60  std::cout << joint_name << " home cmd " << home_cmd << std::endl;
61 
62  const Joint::Ptr &joint = joints_.back();
63 
64  joint->command = home_cmd;
65 
66  joint->name = joint_name;
67  joint->mode = joint_mode;
68 
69  const std::size_t index = joints_.size() - 1;
70  // Store the index we stored this joint at
71  joint_indices_[joint_name] = index;
72  device_joint_indices.push_back(index);
73 
74  hardware_interface::JointStateHandle state_handle(joint_name, &joint->position, &joint->velocity, &joint->effort);
75  state_interface_.registerHandle(state_handle);
76 
77 
78  hardware_interface::JointHandle handle(state_handle, &joint->command);
79 
80  switch (joint_mode)
81  {
83  {
85  break;
86  }
88  {
90  break;
91  }
92  }
93 
94  }
95 
96  device_joints_[*it] = device_joint_indices;
97  max_device_joints_ = std::max(max_device_joints_, device_joint_indices.size());
98  }
99 
100 
101  {
102  base_turret_ = std::make_shared<Joint>("turret");
103  hardware_interface::JointStateHandle state_handle(base_turret_->name, &base_turret_->position, &base_turret_->velocity, &base_turret_->effort);
104  state_interface_.registerHandle(state_handle);
105  hardware_interface::JointHandle handle(state_handle, &base_turret_->command);
107  }
108 
109  {
110  base_left_ = std::make_shared<Joint>("l_wheel");
111  hardware_interface::JointStateHandle state_handle(base_left_->name, &base_left_->position, &base_left_->velocity, &base_left_->effort);
112  state_interface_.registerHandle(state_handle);
113  hardware_interface::JointHandle handle(state_handle, &base_left_->command);
115  }
116 
117  {
118  base_right_ = std::make_shared<Joint>("r_wheel");
119  hardware_interface::JointStateHandle state_handle(base_right_->name, &base_right_->position, &base_right_->velocity, &base_right_->effort);
120  state_interface_.registerHandle(state_handle);
121  hardware_interface::JointHandle handle(state_handle, &base_right_->command);
123  }
124 
125  {
126  base_x_ = std::make_shared<Joint>("base_x");
127  hardware_interface::JointStateHandle state_handle(base_x_->name, &base_x_->position, &base_x_->velocity, &base_x_->effort);
128  hardware_interface::JointHandle handle(state_handle, &base_x_->command);
130  }
131 
132  {
133  base_y_ = std::make_shared<Joint>("base_y");
134  hardware_interface::JointStateHandle state_handle(base_y_->name, &base_y_->position, &base_y_->velocity, &base_y_->effort);
135  hardware_interface::JointHandle handle(state_handle, &base_y_->command);
137  }
138 
139  {
140  base_angle_ = std::make_shared<Joint>("base_angle");
141  hardware_interface::JointStateHandle state_handle(base_angle_->name, &base_angle_->position, &base_angle_->velocity, &base_angle_->effort);
142  hardware_interface::JointHandle handle(state_handle, &base_angle_->command);
144  }
145 
146  {
147  base_mode_ = std::make_shared<Joint>("base_mode");
148  hardware_interface::JointStateHandle state_handle(base_mode_->name, &base_mode_->position, &base_mode_->velocity, &base_mode_->effort);
149  hardware_interface::JointHandle handle(state_handle, &base_mode_->command);
151  }
152 
156 
157  // nh.negotiateTopics();
158 }
159 
161 {
162  delete[] device_joint_buffer_;
163 }
164 
165 void Quori::read(const ros::Time &time, const ros::Duration &period)
166 {
167 
168 
169  const auto start = std::chrono::system_clock::now();
170  for(auto it = devices_.cbegin(); it != devices_.cend(); ++it)
171  {
173  (*it)->getState(state);
174  const auto &indices = device_joints_[*it];
175 
176  std::size_t state_index = 0;
177  for (auto iit = indices.cbegin(); iit != indices.cend(); ++iit, ++state_index)
178  {
179  joints_[*iit]->position = state.measured[state_index];
180  // joints_[*iit]->velocity = state.velocities[state_index];
181  // joints_[*iit]->effort = state.efforts[state_index];
182  }
183  }
184 
185  if (base_vel_ && !last_read_.is_zero())
186  {
187  base_left_->velocity = -(*base_vel_)->x / WHEEL_RADIUS;
188  base_right_->velocity = (*base_vel_)->y / WHEEL_RADIUS;
189  base_turret_->velocity = (*base_vel_)->z / 360 * TAU;
190 
191  const double delta = (time - last_read_).toSec();
192  base_left_->position += base_left_->velocity * delta;
193  base_right_->position += base_right_->velocity * delta;
194  }
195 
196  last_read_ = time;
197 
198  const auto end = std::chrono::system_clock::now();
199 }
200 
201 void Quori::write(const ros::Time &time, const ros::Duration &period)
202 {
204 
205  const auto start = std::chrono::system_clock::now();
206 
207  for (auto it = device_joints_.cbegin(); it != device_joints_.cend(); ++it)
208  {
209  std::size_t i = 0;
210 
211  // Collect the commands for all joints this device controls
212  for (auto jit = it->second.cbegin(); jit != it->second.cend(); ++jit)
213  {
214  device_joint_buffer_[i++] = joints_[*jit]->command;
215  }
216 
217 
218 
219  it->first->setPositions(device_joint_buffer_, i);
220  }
221 
222  std_msgs::Float32 offset;
223  offset.data = base_offset_;
224  base_offset_pub_.publish(offset);
225 
226  if (base_mode_->command >= 0.5)
227  {
228  geometry_msgs::Vector3 base_holo_vel;
229  base_holo_vel.x = base_y_->command;
230  base_holo_vel.y = base_x_->command;
231  base_holo_vel.z = base_angle_->command;
232  base_holo_vel_pub_.publish(base_holo_vel);
233  }
234  else
235  {
236  geometry_msgs::Vector3 base_vel;
237  base_vel.x = WHEEL_RADIUS * -base_left_->command;
238  base_vel.y = WHEEL_RADIUS * base_right_->command;
239  base_vel.z = base_turret_->command / TAU * 360;
240  base_vel_pub_.publish(base_vel);
241  }
242 
243  const auto end = std::chrono::system_clock::now();
244 }
245 
246 void Quori::on_base_vel_status_(const geometry_msgs::Vector3::ConstPtr &msg)
247 {
248  base_vel_ = msg;
249 }
250 
251 void Quori::on_base_turret_pos_(const std_msgs::Float32::ConstPtr &msg)
252 {
253  if (!base_turret_) return;
254 
255  // The received position is in negative revolutions, convert to radians
256  base_turret_->position = -msg->data * TAU;
257 }
wheel_circumference
const double wheel_circumference
Definition: Quori.cpp:15
quori_controller::Quori::state_interface_
hardware_interface::JointStateInterface state_interface_
Definition: Quori.hpp:51
quori::message::States::measured
float measured[3]
Definition: message.hpp:117
quori_controller::Quori::max_device_joints_
std::size_t max_device_joints_
Definition: Quori.hpp:56
quori_controller::Quori::base_mode_
Joint::Ptr base_mode_
Definition: Quori.hpp:72
quori_controller::Quori::base_right_
Joint::Ptr base_right_
Definition: Quori.hpp:67
hardware_interface::InterfaceManager::registerInterface
void registerInterface(T *iface)
quori_controller::Quori::last_read_
ros::Time last_read_
Definition: Quori.hpp:76
quori_controller::Quori::base_vel_
boost::optional< geometry_msgs::Vector3::ConstPtr > base_vel_
Definition: Quori.hpp:74
ros::Publisher::publish
void publish(const boost::shared_ptr< M > &message) const
quori_controller::Quori::read
virtual void read(const ros::Time &time, const ros::Duration &period)
Definition: Quori.cpp:165
quori_controller
Definition: Csv.hpp:10
quori_controller::Joint::Mode::Position
@ Position
quori_controller::Quori::on_base_vel_status_
void on_base_vel_status_(const geometry_msgs::Vector3::ConstPtr &msg)
Definition: Quori.cpp:246
WHEEL_RADIUS
#define WHEEL_RADIUS
Definition: Quori.cpp:13
quori_controller::Quori::base_y_
Joint::Ptr base_y_
Definition: Quori.hpp:70
quori_controller::SerialDevice::InitializationInfo::joints
std::vector< JointInfo > joints
Definition: SerialDevice.hpp:33
std_msgs
quori_controller::Quori::base_turret_
Joint::Ptr base_turret_
Definition: Quori.hpp:65
quori_controller::Quori::base_left_
Joint::Ptr base_left_
Definition: Quori.hpp:66
hardware_interface::JointStateHandle
quori_controller::Quori::joints_
std::vector< Joint::Ptr > joints_
Definition: Quori.hpp:63
quori_controller::SerialDevice::InitializationInfo
Definition: SerialDevice.hpp:25
subscribe
void subscribe()
quori_controller::Joint::Mode::Velocity
@ Velocity
quori_controller::Quori::~Quori
~Quori()
Definition: Quori.cpp:160
quori_controller::Quori::devices_
std::vector< SerialDevice::Ptr > devices_
Definition: Quori.hpp:48
ResourceManager< JointStateHandle >::registerHandle
void registerHandle(const JointStateHandle &handle)
quori_controller::Quori::position_interface_
hardware_interface::PositionJointInterface position_interface_
Definition: Quori.hpp:52
quori_controller::Quori::base_vel_pub_
ros::Publisher base_vel_pub_
Definition: Quori.hpp:42
quori_controller::Quori::device_states_
std::map< SerialDevice::Ptr, quori::message::States > device_states_
Definition: Quori.hpp:49
quori_controller::Joint::Mode
Mode
Definition: Joint.hpp:17
quori_controller::Quori::joint_indices_
std::unordered_map< std::string, std::size_t > joint_indices_
Definition: Quori.hpp:62
start
ROSCPP_DECL void start()
hardware_interface::JointHandle
quori_controller::Quori::device_joints_
std::map< SerialDevice::Ptr, std::vector< std::size_t > > device_joints_
Definition: Quori.hpp:55
quori_controller::Quori::on_base_turret_pos_
void on_base_turret_pos_(const std_msgs::Float32::ConstPtr &msg)
Definition: Quori.cpp:251
ros::Time
quori_controller::Quori::Quori
Quori(ros::NodeHandle &nh, const std::vector< SerialDevice::Ptr > &devices)
Definition: Quori.cpp:17
quori_controller::Quori::base_angle_
Joint::Ptr base_angle_
Definition: Quori.hpp:71
TAU
#define TAU
Definition: Quori.cpp:12
ros::NodeHandle::param
T param(const std::string &param_name, const T &default_val) const
quori_controller::Quori::base_offset_pub_
ros::Publisher base_offset_pub_
Definition: Quori.hpp:44
quori_controller::Joint::Ptr
std::shared_ptr< Joint > Ptr
Definition: Joint.hpp:15
quori_controller::Quori::device_joint_buffer_
double * device_joint_buffer_
Definition: Quori.hpp:57
quori_controller::Quori::base_holo_vel_pub_
ros::Publisher base_holo_vel_pub_
Definition: Quori.hpp:43
TimeBase< Time, Duration >::is_zero
bool is_zero() const
quori_controller::Quori::write
void write()
quori::message::States
Definition: message.hpp:109
ros::Duration
Quori.hpp
quori_controller::Quori::base_offset_
float base_offset_
Definition: Quori.hpp:59
ros::NodeHandle
quori_controller::Quori
Definition: Quori.hpp:25
quori_controller::Quori::base_x_
Joint::Ptr base_x_
Definition: Quori.hpp:69
quori_controller::Quori::velocity_interface_
hardware_interface::VelocityJointInterface velocity_interface_
Definition: Quori.hpp:53


quori_controller
Author(s):
autogenerated on Wed Mar 2 2022 00:53:16