3 #include <std_msgs/Float32.h>
13 #define WHEEL_RADIUS 0.075
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))
25 , max_device_joints_(0)
26 , device_joint_buffer_(nullptr)
39 std::cout << (*it)->getName() <<
":" << std::endl;
43 std::size_t last_index =
joints_.size() - 1;
45 std::vector<std::size_t> device_joint_indices;
47 for (
auto jit = info.
joints.cbegin(); jit != info.
joints.cend(); ++jit)
49 const std::string &joint_name = jit->name;
52 std::cout << joint_name << std::endl;
55 joints_.push_back(std::make_shared<Joint>());
57 double home_cmd = 0.0;
58 pnh.
param(
"home_cmds/" + joint_name, home_cmd, home_cmd);
60 std::cout << joint_name <<
" home cmd " << home_cmd << std::endl;
64 joint->command = home_cmd;
66 joint->name = joint_name;
67 joint->mode = joint_mode;
69 const std::size_t index =
joints_.size() - 1;
72 device_joint_indices.push_back(index);
110 base_left_ = std::make_shared<Joint>(
"l_wheel");
126 base_x_ = std::make_shared<Joint>(
"base_x");
133 base_y_ = std::make_shared<Joint>(
"base_y");
140 base_angle_ = std::make_shared<Joint>(
"base_angle");
147 base_mode_ = std::make_shared<Joint>(
"base_mode");
169 const auto start = std::chrono::system_clock::now();
173 (*it)->getState(state);
176 std::size_t state_index = 0;
177 for (
auto iit = indices.cbegin(); iit != indices.cend(); ++iit, ++state_index)
191 const double delta = (time -
last_read_).toSec();
198 const auto end = std::chrono::system_clock::now();
205 const auto start = std::chrono::system_clock::now();
212 for (
auto jit = it->second.cbegin(); jit != it->second.cend(); ++jit)
222 std_msgs::Float32 offset;
228 geometry_msgs::Vector3 base_holo_vel;
229 base_holo_vel.x =
base_y_->command;
230 base_holo_vel.y =
base_x_->command;
236 geometry_msgs::Vector3 base_vel;
243 const auto end = std::chrono::system_clock::now();