20 const std::map<int, std::string>
k_object_class = { { 0,
"UNKNOWN" }, { 1,
"PERSON" }, { 2,
"LUGGAGE" },
21 { 3,
"TROLLEY" }, { 4,
"TRUCK" }, { 5,
"BUS" },
22 { 6,
"CAR" }, { 7,
"VAN" }, { 8,
"TWO_WHEELER" },
23 { 9,
"MASK" }, { 10,
"NO_MASK" } };
29 sensor_msgs::PointField x_field;
32 x_field.datatype = sensor_msgs::PointField::FLOAT32;
35 sensor_msgs::PointField y_field;
38 y_field.datatype = sensor_msgs::PointField::FLOAT32;
41 sensor_msgs::PointField z_field;
44 z_field.datatype = sensor_msgs::PointField::FLOAT32;
47 pointCloud.fields.push_back(x_field);
48 pointCloud.fields.push_back(y_field);
49 pointCloud.fields.push_back(z_field);
52 void define_points_data(sensor_msgs::PointCloud2 &pointCloud,
const uint32_t layers,
const uint32_t points,
53 float *pointData,
bool use_colwise_order)
57 pointCloud.height = 1;
58 pointCloud.width = points;
60 pointCloud.height = layers;
61 pointCloud.width = points / layers;
65 constexpr
size_t point_size = 3 *
sizeof(float);
66 pointCloud.point_step = point_size;
67 pointCloud.row_step = pointCloud.width * pointCloud.point_step;
70 const uint8_t *point_data =
reinterpret_cast<uint8_t *
>(pointData);
71 const size_t total_size = point_size * points;
72 if (use_colwise_order || !layers) {
73 pointCloud.data.assign(point_data, point_data + total_size);
75 pointCloud.data.resize(total_size);
76 size_t colwise_idx = 0;
77 for (uint32_t w = 0; w < pointCloud.width; ++w) {
78 for (uint32_t h = 0; h < layers; ++h, colwise_idx += point_size) {
79 size_t rowwise_idx = (h * pointCloud.width + w) * point_size;
80 std::copy(&point_data[colwise_idx], &point_data[colwise_idx] + point_size,
81 &(pointCloud.data[rowwise_idx]));
85 pointCloud.is_dense =
true;
88 void define_pose(geometry_msgs::Pose &pose,
const std::array<float, 3> &position,
const std::array<float, 9> &rotation)
90 pose.position.x = position[0];
91 pose.position.y = position[1];
92 pose.position.z = position[2];
95 float t = rotation[0] + rotation[4] + rotation[8];
98 float r = sqrt(1 +
t);
99 float s = 1 / (2 * r);
101 pose.orientation.x = (rotation[5] - rotation[7]) *
s;
102 pose.orientation.y = (rotation[6] - rotation[2]) *
s;
103 pose.orientation.z = (rotation[1] - rotation[3]) *
s;
104 pose.orientation.w = r / 2;
105 }
else if (rotation[0] > rotation[4] && rotation[0] > rotation[8]) {
106 float r = sqrt(1.0
f + rotation[0] - rotation[4] - rotation[8]);
107 float s = 1 / (2 * r);
108 pose.orientation.x = r / 2;
109 pose.orientation.y = (rotation[1] + rotation[3]) *
s;
110 pose.orientation.z = (rotation[2] + rotation[6]) *
s;
111 pose.orientation.w = (rotation[5] - rotation[7]) *
s;
112 }
else if (rotation[4] > rotation[8]) {
113 float r = sqrt(1.0
f + rotation[4] - rotation[0] - rotation[8]);
114 float s = 1 / (2 * r);
115 pose.orientation.x = (rotation[1] + rotation[3]) *
s;
116 pose.orientation.y = r / 2;
117 pose.orientation.z = (rotation[5] + rotation[7]) *
s;
118 pose.orientation.w = (rotation[6] - rotation[2]) *
s;
120 float r = sqrt(1.0
f + rotation[8] - rotation[0] - rotation[4]);
121 float s = 1 / (2 * r);
122 pose.orientation.x = (rotation[6] + rotation[2]) *
s;
123 pose.orientation.y = (rotation[5] + rotation[7]) *
s;
124 pose.orientation.z = r / 2;
125 pose.orientation.w = (rotation[1] - rotation[3]) *
s;
137 pose.position.x = 0.0f;
138 pose.position.y = 0.0f;
139 pose.position.z = 0.0f;
140 pose.orientation.x = 0.0f;
141 pose.orientation.y = 0.0f;
142 pose.orientation.z = 0.0f;
143 pose.orientation.w = 1.0f;
146 void parse_zone_data(
const std::string &raw_zones, outsight_alb_driver::Zones &zones_msg)
148 const json parsed_zones = json::parse(raw_zones);
153 outsight_alb_driver::ZoneData zone;
159 geometry_msgs::Point point;
160 point.x = (*pt_it)[0];
161 point.y = (*pt_it)[1];
162 zone.points.push_back(point);
166 zones_msg.zones.push_back(zone);
173 Tlv::Parser parser(frame->getValue(), frame->getLength());
176 ROS_ERROR(
"[AlbHelper] Scan frame not found, unable to publish PoseStamped message.");
180 Tlv::Parser frameParser(frameTlv->getValue(), frameTlv->getLength());
183 ROS_ERROR(
"[AlbHelper] Pose not found, unable to publish PoseStamped message.");
190 define_pose(pose.pose, pose_translation, pose_rotation);
197 Tlv::Parser parser(frame->getValue(), frame->getLength());
200 ROS_ERROR(
"[AlbHelper] Scan frame not found, unable to publish PoseStamped message.");
204 Tlv::Parser frameParser(frameTlv->getValue(), frameTlv->getLength());
206 if (!egomotion_tlv) {
207 ROS_ERROR(
"[AlbHelper] Egomotion not found, unable to publish PoseStamped message.");
211 Tlv::Parser egomotionParser(egomotion_tlv->getValue(), egomotion_tlv->getLength());
214 ROS_ERROR(
"[AlbHelper] Pose not found, unable to publish PoseStamped message.");
221 define_pose(pose.pose, pose_translation, pose_rotation);
226 void computeOdometry(nav_msgs::Odometry &odom,
const geometry_msgs::Pose ¤t_pose,
227 const geometry_msgs::Pose &last_pose,
const geometry_msgs::Pose &first_pose,
float dt)
230 geometry_msgs::PoseStamped global_pose;
231 geometry_msgs::PoseStamped global_pose_from_first;
232 global_pose.pose.position.x = current_pose.position.x - first_pose.position.x;
233 global_pose.pose.position.y = current_pose.position.y - first_pose.position.y;
234 global_pose.pose.position.z = current_pose.position.z - first_pose.position.z;
237 geometry_msgs::TransformStamped local_transform;
238 local_transform.transform.rotation = first_pose.orientation;
239 local_transform.transform.rotation.w = -local_transform.transform.rotation.w;
244 odom.pose.pose.position.x = global_pose_from_first.pose.position.x;
245 odom.pose.pose.position.y = global_pose_from_first.pose.position.y;
246 odom.pose.pose.position.z = global_pose_from_first.pose.position.z;
252 tf2::fromMsg(current_pose.orientation, current_orientation);
253 tf2::fromMsg(first_pose.orientation, first_orientation);
254 odom_orientation = current_orientation * first_orientation.
inverse();
256 odom.pose.pose.orientation =
tf2::toMsg(odom_orientation);
259 geometry_msgs::PoseStamped local_pose;
260 geometry_msgs::PoseStamped local_pose_from_first;
261 local_pose.pose.position.x = current_pose.position.x - last_pose.position.x;
262 local_pose.pose.position.y = current_pose.position.y - last_pose.position.y;
263 local_pose.pose.position.z = current_pose.position.z - last_pose.position.z;
268 odom.twist.twist.linear.x = local_pose_from_first.pose.position.x / dt;
269 odom.twist.twist.linear.y = local_pose_from_first.pose.position.y / dt;
270 odom.twist.twist.linear.z = local_pose_from_first.pose.position.z / dt;
276 egomotion_orientation = current_orientation * last_orientation.
inverse();
282 m.
getRPY(roll, pitch, yaw);
284 odom.twist.twist.angular.x = roll / dt;
285 odom.twist.twist.angular.y = pitch / dt;
286 odom.twist.twist.angular.z = yaw / dt;
291 std::string object_class(
"UNKNOWN");
300 void define_box_size(outsight_alb_driver::ObjectData &tracked,
const Tlv::tlv_s *bBoxSizes,
size_t objectIndex)
302 float *bbox_size_raw = (
float *)(bBoxSizes->getValue() + 3 *
sizeof(float) * objectIndex);
304 tracked.box_size.x = bbox_size_raw[0];
305 tracked.box_size.y = bbox_size_raw[1];
306 tracked.box_size.z = bbox_size_raw[2];
309 void define_box_pose(outsight_alb_driver::ObjectData &tracked,
const Tlv::tlv_s *bBoxPoses,
size_t objectIndex)
313 define_pose(tracked.pose, pose_translation, pose_rotation);
316 void define_object_speed(outsight_alb_driver::ObjectData &tracked,
const Tlv::tlv_s *objectSpeeds,
size_t objectIndex)
318 float *speed_raw = (
float *)(objectSpeeds->getValue() + 3 *
sizeof(float) * objectIndex);
320 tracked.speed.linear.x = speed_raw[0];
321 tracked.speed.linear.y = speed_raw[1];
322 tracked.speed.linear.z = speed_raw[2];
327 Tlv::Parser aug_cloud_parser(frame->getValue(), frame->getLength());
335 if (reflectivities_tlv) {
336 message.reflectivities = std::vector<uint8_t>(
337 reflectivities_tlv->getValue(), reflectivities_tlv->getValue() + message.number_of_points);
342 float *cartesian = (
float *)(cartesian_tlv->getValue());
343 message.cartesian_coordinates = std::vector<float>(cartesian, cartesian + 3 * message.number_of_points);
347 if (object_ids_tlv) {