15#include <lanelet2_extension/regulatory_elements/CarmaTrafficSignal.h>
16#include <tf2/LinearMath/Transform.h>
17#include <wgs84_utils/wgs84_utils.h>
23#include <boost/date_time/posix_time/posix_time.hpp>
26#include <rclcpp/logger.hpp>
27#include <rclcpp/logging.hpp>
28#include <rclcpp/rclcpp.hpp>
30#include <carma_perception_msgs/msg/external_object.hpp>
31#include <carma_v2x_msgs/msg/psm.hpp>
32#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
39 const carma_v2x_msgs::msg::PSM & in_msg, carma_perception_msgs::msg::ExternalObject & out_msg,
40 const std::string & map_frame_id,
double pred_period,
double pred_step_size,
42 const lanelet::projection::LocalFrameProjector & map_projector,
43 const tf2::Quaternion & ned_in_map_rotation,
44 rclcpp::node_interfaces::NodeClockInterface::SharedPtr node_clock)
47 out_msg.dynamic_obj =
true;
49 out_msg.presence_vector |= carma_perception_msgs::msg::ExternalObject::DYNAMIC_OBJ_PRESENCE;
54 for (
int i = in_msg.id.id.size() - 1;
i >= 0;
59 out_msg.id |= in_msg.id.id[
i] << (8 *
i);
61 out_msg.presence_vector |= carma_perception_msgs::msg::ExternalObject::ID_PRESENCE_VECTOR;
65 out_msg.bsm_id = in_msg.id.id;
66 out_msg.presence_vector |= carma_perception_msgs::msg::ExternalObject::BSM_ID_PRESENCE_VECTOR;
72 out_msg.header.stamp = builtin_interfaces::msg::Time(psm_timestamp);
73 out_msg.header.frame_id = map_frame_id;
79 in_msg.basic_type.type == j2735_v2x_msgs::msg::PersonalDeviceUserType::A_PEDESTRIAN ||
80 in_msg.basic_type.type == j2735_v2x_msgs::msg::PersonalDeviceUserType::A_PUBLIC_SAFETY_WORKER ||
81 in_msg.basic_type.type ==
82 j2735_v2x_msgs::msg::PersonalDeviceUserType::AN_ANIMAL)
88 out_msg.object_type = carma_perception_msgs::msg::ExternalObject::PEDESTRIAN;
99 in_msg.basic_type.type == j2735_v2x_msgs::msg::PersonalDeviceUserType::A_PEDALCYCLIST) {
100 out_msg.object_type = carma_perception_msgs::msg::ExternalObject::
105 out_msg.size.x = 1.0;
106 out_msg.size.y = 0.5;
107 out_msg.size.z = 1.0;
109 out_msg.object_type = carma_perception_msgs::msg::ExternalObject::UNKNOWN;
112 out_msg.size.x = 0.5;
113 out_msg.size.y = 0.5;
114 out_msg.size.z = 1.0;
116 out_msg.presence_vector |= carma_perception_msgs::msg::ExternalObject::SIZE_PRESENCE_VECTOR;
121 out_msg.velocity.twist.linear.x = in_msg.speed.velocity;
122 out_msg.presence_vector |= carma_perception_msgs::msg::ExternalObject::VELOCITY_PRESENCE_VECTOR;
132 double largest_position_std = 0.0;
133 double lat_variance = 0.0;
134 double lon_variance = 0.0;
135 double heading_variance = 0.0;
137 double position_confidence = 0.0;
142 constexpr double MAX_POSITION_STD = 1.85;
145 (in_msg.accuracy.presence_vector |
146 carma_v2x_msgs::msg::PositionalAccuracy::ACCURACY_AVAILABLE) &&
147 (in_msg.accuracy.presence_vector |
148 carma_v2x_msgs::msg::PositionalAccuracy::ACCURACY_ORIENTATION_AVAILABLE)) {
154 largest_position_std = std::max(in_msg.accuracy.semi_major, in_msg.accuracy.semi_minor);
155 lat_variance = in_msg.accuracy.semi_minor * in_msg.accuracy.semi_minor;
156 lon_variance = in_msg.accuracy.semi_major * in_msg.accuracy.semi_major;
157 heading_variance = in_msg.accuracy.orientation * in_msg.accuracy.orientation;
168 out_msg.confidence = 1.0 - std::min(1.0, fabs(largest_position_std / MAX_POSITION_STD));
169 out_msg.presence_vector |=
170 carma_perception_msgs::msg::ExternalObject::CONFIDENCE_PRESENCE_VECTOR;
172 in_msg.accuracy.presence_vector | carma_v2x_msgs::msg::PositionalAccuracy::ACCURACY_AVAILABLE) {
175 largest_position_std = std::max(in_msg.accuracy.semi_major, in_msg.accuracy.semi_minor);
176 lat_variance = in_msg.accuracy.semi_minor * in_msg.accuracy.semi_minor;
177 lon_variance = in_msg.accuracy.semi_major * in_msg.accuracy.semi_major;
178 heading_variance = 1.0;
182 out_msg.confidence = 1.0 - std::min(1.0, fabs(largest_position_std / MAX_POSITION_STD));
183 out_msg.presence_vector |=
184 carma_perception_msgs::msg::ExternalObject::CONFIDENCE_PRESENCE_VECTOR;
187 in_msg.accuracy.presence_vector |
188 carma_v2x_msgs::msg::PositionalAccuracy::ACCURACY_ORIENTATION_AVAILABLE) {
194 heading_variance = in_msg.accuracy.orientation * in_msg.accuracy.orientation;
198 heading_variance = 1.0;
203 lanelet::GPSPoint gps_point(
204 {in_msg.position.latitude, in_msg.position.longitude, in_msg.position.elevation});
206 map_projector, ned_in_map_rotation, gps_point, in_msg.heading.heading, lat_variance,
207 lon_variance, heading_variance);
208 out_msg.presence_vector |= carma_perception_msgs::msg::ExternalObject::POSE_PRESENCE_VECTOR;
215 std::vector<geometry_msgs::msg::Pose> predicted_poses;
217 if (in_msg.presence_vector & carma_v2x_msgs::msg::PSM::HAS_PATH_PREDICTION) {
221 out_msg.pose.pose, out_msg.velocity.twist.linear.x,
222 -in_msg.path_prediction.radius_of_curvature, pred_period, pred_step_size);
225 out_msg.pose.pose, out_msg.velocity.twist.linear.x, pred_period, pred_step_size);
229 predicted_poses, out_msg.velocity.twist.linear.x, rclcpp::Time(out_msg.header.stamp),
230 rclcpp::Duration::from_nanoseconds(pred_step_size * 1e9), map_frame_id, out_msg.confidence,
232 out_msg.presence_vector |= carma_perception_msgs::msg::ExternalObject::PREDICTION_PRESENCE_VECTOR;
238 const geometry_msgs::msg::Pose & pose,
double velocity,
double radius_of_curvature,
double period,
241 std::vector<geometry_msgs::msg::Pose> output;
242 output.reserve((period / step_size) + 1);
244 tf2::Vector3 pose_in_map_translation(pose.position.x, pose.position.y, pose.position.z);
245 tf2::Quaternion pose_in_map_quat(
246 pose.orientation.x, pose.orientation.y, pose.orientation.z, pose.orientation.w);
247 tf2::Transform pose_in_map(pose_in_map_quat, pose_in_map_translation);
251 double center_x_in_pose = 0;
252 double center_y_in_pose = radius_of_curvature;
256 while (total_dt < period) {
258 total_dt += step_size;
259 double delta_arc_length = velocity * total_dt;
261 double turning_angle = delta_arc_length / radius_of_curvature;
262 double dx_from_center = radius_of_curvature * sin(turning_angle);
263 double dy_from_center = radius_of_curvature * cos(turning_angle);
265 double x = center_x_in_pose + dx_from_center;
266 double y = center_y_in_pose + dy_from_center;
268 tf2::Vector3 position(
x,
y, 0);
270 tf2::Quaternion quat;
271 quat.setRPY(0, 0, turning_angle);
274 tf2::Transform pose_to_sample(quat, position);
275 tf2::Transform map_to_sample = pose_in_map * pose_to_sample;
277 geometry_msgs::msg::Pose sample_pose;
279 sample_pose.position.x = map_to_sample.getOrigin().x();
280 sample_pose.position.y = map_to_sample.getOrigin().y();
281 sample_pose.position.z = pose.orientation.z;
283 sample_pose.orientation.x = map_to_sample.getRotation().x();
284 sample_pose.orientation.y = map_to_sample.getRotation().y();
285 sample_pose.orientation.z = map_to_sample.getRotation().z();
286 sample_pose.orientation.w = map_to_sample.getRotation().w();
288 output.emplace_back(sample_pose);
295 const geometry_msgs::msg::Pose & pose,
double velocity,
double period,
double step_size)
297 std::vector<geometry_msgs::msg::Pose> output;
298 output.reserve((period / step_size) + 1);
300 tf2::Vector3 pose_in_map_translation(pose.position.x, pose.position.y, pose.position.z);
301 tf2::Quaternion pose_in_map_quat(
302 pose.orientation.x, pose.orientation.y, pose.orientation.z, pose.orientation.w);
304 tf2::Transform pose_in_map(pose_in_map_quat, pose_in_map_translation);
308 while (total_dt < period) {
310 total_dt += step_size;
311 double dx_from_start = velocity * total_dt;
313 double x = pose.position.x + dx_from_start;
315 tf2::Vector3 position(
x, 0, 0);
318 tf2::Transform pose_to_sample(tf2::Quaternion::getIdentity(), position);
319 tf2::Transform map_to_sample = pose_in_map * pose_to_sample;
321 geometry_msgs::msg::Pose sample_pose;
323 sample_pose.position.x = map_to_sample.getOrigin().x();
324 sample_pose.position.y = map_to_sample.getOrigin().y();
325 sample_pose.position.z = map_to_sample.getOrigin().z();
327 sample_pose.orientation.x = map_to_sample.getRotation().x();
328 sample_pose.orientation.y = map_to_sample.getRotation().y();
329 sample_pose.orientation.z = map_to_sample.getRotation().z();
330 sample_pose.orientation.w = map_to_sample.getRotation().w();
332 output.emplace_back(sample_pose);
341 const lanelet::projection::LocalFrameProjector & projector,
342 const tf2::Quaternion & ned_in_map_rotation,
const lanelet::GPSPoint & gps_point,
343 const double & heading,
const double lat_variance,
const double lon_variance,
344 const double heading_variance)
348 lanelet::BasicPoint3d map_point = projector.forward(gps_point);
351 rclcpp::get_logger(
"motion_computation::conversion"),
352 "map_point: " << map_point.x() <<
", " << map_point.y() <<
", " << map_point.z());
355 fabs(map_point.x()) > 10000.0 ||
356 fabs(map_point.y()) > 10000.0) {
360 rclcpp::get_logger(
"motion_computation::conversion"),
361 "Distance from map origin is larger than supported by system "
362 "assumptions. Strongly advise "
363 "alternative map origin be used. ");
374 tf2::Quaternion R_m_n(ned_in_map_rotation);
376 tf2::Quaternion R_n_h;
377 R_n_h.setRPY(0, 0, heading * wgs84_utils::DEG2RAD);
379 tf2::Quaternion R_m_s = R_m_n * R_n_h;
384 rclcpp::get_logger(
"motion_computation::conversion"),
385 "R_m_n (x,y,z,w) : ( " << R_m_n.x() <<
", " << R_m_n.y() <<
", " << R_m_n.z() <<
", "
389 rclcpp::get_logger(
"motion_computation::conversion"),
390 "R_n_h (x,y,z,w) : ( " << R_n_h.x() <<
", " << R_n_h.y() <<
", " << R_n_h.z() <<
", "
394 rclcpp::get_logger(
"motion_computation::conversion"),
395 "R_m_s (x,y,z,w) : ( " << R_m_s.x() <<
", " << R_m_s.y() <<
", " << R_m_s.z() <<
", "
398 tf2::Transform T_m_s(
400 map_point.x(), map_point.y(),
404 tf2::Transform T_m_n_no_heading(
405 R_m_n, tf2::Vector3(0, 0, 0));
411 std::array<double, 36> input_covariance = {
412 lat_variance, 0, 0, 0, 0, 0,
413 0, lon_variance, 0, 0, 0, 0,
417 0, 0, 0, 0, 0, heading_variance
429 geometry_msgs::msg::PoseWithCovariance pose;
430 pose.pose.position.x = T_m_s.getOrigin().getX();
431 pose.pose.position.y = T_m_s.getOrigin().getY();
432 pose.pose.position.z = T_m_s.getOrigin().getZ();
434 pose.pose.orientation.x = T_m_s.getRotation().getX();
435 pose.pose.orientation.y = T_m_s.getRotation().getY();
436 pose.pose.orientation.z = T_m_s.getRotation().getZ();
437 pose.pose.orientation.w = T_m_s.getRotation().getW();
439 pose.covariance = new_cov;
445 const std::vector<geometry_msgs::msg::Pose> & poses,
double constant_velocity,
446 const rclcpp::Time & start_time,
const rclcpp::Duration & step_size,
const std::string & frame,
447 double initial_pose_confidence,
double initial_vel_confidence)
449 std::vector<carma_perception_msgs::msg::PredictedState> output;
450 output.reserve(poses.size());
452 rclcpp::Time time(start_time);
454 for (
auto p : poses) {
456 carma_perception_msgs::msg::PredictedState pred_state;
457 pred_state.header.stamp = time;
458 pred_state.header.frame_id = frame;
460 pred_state.predicted_position = p;
461 pred_state.predicted_position_confidence =
462 0.9 * initial_pose_confidence;
463 initial_pose_confidence = pred_state.predicted_position_confidence;
465 pred_state.predicted_velocity.linear.x = constant_velocity;
466 pred_state.predicted_velocity_confidence =
467 0.9 * initial_vel_confidence;
469 initial_vel_confidence = pred_state.predicted_velocity_confidence;
471 output.push_back(pred_state);
478 const carma_v2x_msgs::msg::PSM & in_msg, rclcpp::Clock::SharedPtr clock)
480 boost::posix_time::ptime utc_time_of_current_psm;
483 static const boost::posix_time::ptime inception_boost(
484 boost::posix_time::time_from_string(
"1970-01-01 00:00:00.000"));
494 const auto initial_position_time{in_msg.path_history.initial_position.utc_time};
495 if ((in_msg.presence_vector &
496 carma_v2x_msgs::msg::PSM::HAS_PATH_HISTORY) &&
497 (in_msg.path_history.presence_vector &
498 carma_v2x_msgs::msg::PathHistory::HAS_INITIAL_POSITION) &&
499 (initial_position_time.presence_vector & j2735_v2x_msgs::msg::DDateTime::YEAR) &&
500 (initial_position_time.presence_vector & j2735_v2x_msgs::msg::DDateTime::MONTH) &&
501 (initial_position_time.presence_vector & j2735_v2x_msgs::msg::DDateTime::DAY) &&
502 (initial_position_time.presence_vector & j2735_v2x_msgs::msg::DDateTime::HOUR) &&
503 (initial_position_time.presence_vector & j2735_v2x_msgs::msg::DDateTime::MINUTE) &&
504 (initial_position_time.presence_vector & j2735_v2x_msgs::msg::DDateTime::SECOND) &&
505 (in_msg.sec_mark.millisecond == initial_position_time.second.millisecond)) {
508 rclcpp::get_logger(
"motion_computation::conversion"),
509 "Using UTC time of path history to determine PSM "
510 "timestamp. Assumed valid since UTC is fully specified "
511 "and sec_mark == utc_time.seconds in this message.");
513 boost::posix_time::time_duration time_of_day =
514 boost::posix_time::hours(in_msg.path_history.initial_position.utc_time.hour.hour) +
515 boost::posix_time::minutes(in_msg.path_history.initial_position.utc_time.minute.minute) +
516 boost::posix_time::milliseconds(
517 in_msg.path_history.initial_position.utc_time.second.millisecond);
519 boost::gregorian::date utc_day(
520 in_msg.path_history.initial_position.utc_time.year.year,
521 in_msg.path_history.initial_position.utc_time.month.month,
522 in_msg.path_history.initial_position.utc_time.day.day);
524 utc_time_of_current_psm = boost::posix_time::ptime(utc_day) + time_of_day;
528 RCLCPP_WARN_STREAM_THROTTLE(
529 rclcpp::get_logger(
"motion_computation::conversion"), *clock.get(),
530 rclcpp::Duration(5, 0).nanoseconds(),
531 "PSM PathHistory utc timstamp does not match "
532 "sec_mark. Unable to determine the minute of "
533 "the year used for PSM data. Assuming local "
534 "clock is exactly synced. This is NOT "
538 auto current_time = clock->now();
541 boost::posix_time::time_duration duration_since_inception(
542 lanelet::time::durationFromSec(current_time.seconds()));
545 auto curr_time_boost = inception_boost + duration_since_inception;
548 auto duration_in_day_till_current_time = curr_time_boost.time_of_day();
551 auto hour_count_in_day = duration_in_day_till_current_time.hours();
552 auto minute_count_in_hour = duration_in_day_till_current_time.minutes();
555 auto start_of_minute_in_day = boost::posix_time::hours(hour_count_in_day) +
556 boost::posix_time::minutes(minute_count_in_hour);
559 boost::posix_time::ptime start_of_day(curr_time_boost.date());
562 boost::posix_time::ptime utc_start_of_current_minute = start_of_day + start_of_minute_in_day;
566 boost::posix_time::time_duration s_in_cur_minute =
567 boost::posix_time::milliseconds(in_msg.sec_mark.millisecond);
569 utc_time_of_current_psm = utc_start_of_current_minute + s_in_cur_minute;
572 boost::posix_time::time_duration nsec_since_epoch = utc_time_of_current_psm - inception_boost;
574 if (nsec_since_epoch.is_special()) {
576 rclcpp::get_logger(
"motion_computation::conversion"),
577 "Computed psm nsec_since_epoch is special (computation "
578 "failed). Value effectively undefined.");
581 return rclcpp::Time(nsec_since_epoch.total_nanoseconds());
geometry_msgs::msg::PoseWithCovariance::_covariance_type transformCovariance(const geometry_msgs::msg::PoseWithCovariance::_covariance_type &cov_in, const tf2::Transform &transform)
Transform the covariance matrix of a PoseWithCovariance message to a new frame.
std::vector< geometry_msgs::msg::Pose > sample_2d_path_from_radius(const geometry_msgs::msg::Pose &pose, double velocity, double radius_of_curvature, double period, double step_size)
geometry_msgs::msg::PoseWithCovariance pose_from_gnss(const lanelet::projection::LocalFrameProjector &projector, const tf2::Quaternion &ned_in_map_rotation, const lanelet::GPSPoint &gps_point, const double &heading, const double lat_variance, const double lon_variance, const double heading_variance)
std::vector< carma_perception_msgs::msg::PredictedState > predicted_poses_to_predicted_state(const std::vector< geometry_msgs::msg::Pose > &poses, double constant_velocity, const rclcpp::Time &start_time, const rclcpp::Duration &step_size, const std::string &frame, double initial_pose_confidence, double initial_vel_confidence)
rclcpp::Time get_psm_timestamp(const carma_v2x_msgs::msg::PSM &in_msg, rclcpp::Clock::SharedPtr clock)
std::vector< geometry_msgs::msg::Pose > sample_2d_linear_motion(const geometry_msgs::msg::Pose &pose, double velocity, double period, double step_size)
void convert(const carma_v2x_msgs::msg::PSM &in_msg, carma_perception_msgs::msg::ExternalObject &out_msg, const std::string &map_frame_id, double pred_period, double pred_step_size, const lanelet::projection::LocalFrameProjector &map_projector, const tf2::Quaternion &ned_in_map_rotation, rclcpp::node_interfaces::NodeClockInterface::SharedPtr node_clock)