2021-11-01 07:26:45 +00:00
|
|
|
#include "autoware_v2x/v2x_node.hpp"
|
2021-11-10 08:14:09 +00:00
|
|
|
#include "autoware_v2x/v2x_app.hpp"
|
2021-10-27 21:56:21 +00:00
|
|
|
#include "autoware_v2x/time_trigger.hpp"
|
|
|
|
#include "autoware_v2x/router_context.hpp"
|
|
|
|
#include "autoware_v2x/positioning.hpp"
|
|
|
|
#include "autoware_v2x/security.hpp"
|
|
|
|
#include "autoware_v2x/link_layer.hpp"
|
|
|
|
#include "autoware_v2x/cpm_application.hpp"
|
2024-06-12 22:51:59 +00:00
|
|
|
#include "autoware_v2x/cam_application.hpp"
|
2021-10-27 21:56:21 +00:00
|
|
|
|
2024-07-08 10:08:49 +00:00
|
|
|
#include "autoware_adapi_v1_msgs/srv/get_vehicle_dimensions.hpp"
|
|
|
|
#include "autoware_adapi_v1_msgs/msg/vehicle_dimensions.hpp"
|
|
|
|
|
2021-10-27 21:56:21 +00:00
|
|
|
#include "rclcpp/rclcpp.hpp"
|
|
|
|
#include "std_msgs/msg/string.hpp"
|
|
|
|
|
|
|
|
#include <vanetza/asn1/cpm.hpp>
|
2024-06-12 22:51:59 +00:00
|
|
|
#include <vanetza/asn1/cam.hpp>
|
2021-10-27 21:56:21 +00:00
|
|
|
#include <sstream>
|
|
|
|
#include <memory>
|
|
|
|
#include <boost/thread.hpp>
|
2021-11-10 08:14:09 +00:00
|
|
|
#include <boost/date_time/posix_time/posix_time.hpp>
|
2021-10-27 21:56:21 +00:00
|
|
|
|
2022-05-19 11:00:02 +00:00
|
|
|
#include "tf2/LinearMath/Quaternion.h"
|
2022-07-21 00:13:25 +00:00
|
|
|
#include <chrono>
|
|
|
|
#include <iostream>
|
2022-09-14 07:14:44 +00:00
|
|
|
#include <random>
|
2022-05-19 11:00:02 +00:00
|
|
|
|
2021-10-27 21:56:21 +00:00
|
|
|
namespace gn = vanetza::geonet;
|
|
|
|
|
|
|
|
using namespace vanetza;
|
|
|
|
using namespace std::chrono;
|
|
|
|
|
|
|
|
namespace v2x
|
|
|
|
{
|
2022-01-15 07:14:17 +00:00
|
|
|
V2XNode::V2XNode(const rclcpp::NodeOptions &node_options) : rclcpp::Node("autoware_v2x_node", node_options) {
|
2021-10-27 21:56:21 +00:00
|
|
|
using std::placeholders::_1;
|
|
|
|
|
2022-10-31 09:51:20 +00:00
|
|
|
objects_sub_ = this->create_subscription<autoware_auto_perception_msgs::msg::PredictedObjects>("/perception/object_recognition/objects", 10, std::bind(&V2XNode::objectsCallback, this, _1));
|
|
|
|
tf_sub_ = this->create_subscription<tf2_msgs::msg::TFMessage>("/tf", 10, std::bind(&V2XNode::tfCallback, this, _1));
|
2024-06-28 13:11:04 +00:00
|
|
|
|
2024-06-12 22:51:59 +00:00
|
|
|
// Topic subscriptions for CAMApplication
|
|
|
|
velocity_report_sub_ = this->create_subscription<autoware_auto_vehicle_msgs::msg::VelocityReport>("/vehicle/status/velocity_status", 10, std::bind(&V2XNode::velocityReportCallback, this, _1));
|
2024-07-09 13:54:53 +00:00
|
|
|
vehicle_status_sub_ = this->create_subscription<autoware_adapi_v1_msgs::msg::VehicleStatus>("/api/vehicle/status", 10, std::bind(&V2XNode::vehicleStatucCallback, this, _1));
|
2024-07-08 10:08:49 +00:00
|
|
|
get_vehicle_dimensions_ = this->create_client<autoware_adapi_v1_msgs::srv::GetVehicleDimensions>("/api/vehicle/dimensions");
|
|
|
|
if (get_vehicle_dimensions_->wait_for_service(std::chrono::seconds(60))) {
|
|
|
|
RCLCPP_INFO(get_logger(), "[V2XNode::getVehicleDimensions] Service /api/vehicle/dimensions is now available.");
|
|
|
|
this->getVehicleDimensions();
|
|
|
|
} else {
|
|
|
|
RCLCPP_ERROR(get_logger(), "[V2XNode::getVehicleDimensions] Service /api/vehicle/dimensions is not available after waiting (timeout=60s).");
|
|
|
|
}
|
2021-10-27 21:56:21 +00:00
|
|
|
|
2022-10-31 09:51:20 +00:00
|
|
|
cpm_objects_pub_ = create_publisher<autoware_auto_perception_msgs::msg::PredictedObjects>("/v2x/cpm/objects", rclcpp::QoS{10});
|
|
|
|
// cpm_sender_pub_ = create_publisher<autoware_auto_perception_msgs::msg::PredictedObjects>("/v2x/cpm/sender", rclcpp::QoS{10});
|
2021-10-27 21:56:21 +00:00
|
|
|
|
2022-10-31 09:51:20 +00:00
|
|
|
// Declare Parameters
|
2024-07-09 14:28:56 +00:00
|
|
|
this->declare_parameter<std::string>("network_interface", "vmnet1");
|
2022-02-27 03:26:11 +00:00
|
|
|
this->declare_parameter<bool>("is_sender", true);
|
2021-12-08 11:33:06 +00:00
|
|
|
|
2022-10-31 09:51:20 +00:00
|
|
|
// Launch V2XApp in a new thread
|
2021-11-10 08:14:09 +00:00
|
|
|
app = new V2XApp(this);
|
|
|
|
boost::thread v2xApp(boost::bind(&V2XApp::start, app));
|
2021-10-27 21:56:21 +00:00
|
|
|
|
2021-11-10 15:21:32 +00:00
|
|
|
RCLCPP_INFO(get_logger(), "V2X Node Launched");
|
2022-01-15 07:14:17 +00:00
|
|
|
|
2022-10-31 09:51:20 +00:00
|
|
|
// Make latency_log file from current timestamp
|
2022-07-21 00:13:25 +00:00
|
|
|
time_t t = time(nullptr);
|
|
|
|
const tm* lt = localtime(&t);
|
|
|
|
std::stringstream s;
|
2022-10-31 09:51:20 +00:00
|
|
|
s << "20" << lt->tm_year-100 <<"-" << lt->tm_mon+1 << "-" << lt->tm_mday << "_" << lt->tm_hour << ":" << lt->tm_min << ":" << lt->tm_sec;
|
2022-07-21 00:13:25 +00:00
|
|
|
std::string timestamp = s.str();
|
|
|
|
char cur_dir[1024];
|
|
|
|
getcwd(cur_dir, 1024);
|
|
|
|
std::string latency_log_filename = std::string(cur_dir) + "/latency_logs/latency_log_file_" + timestamp + ".csv";
|
|
|
|
latency_log_file.open(latency_log_filename, std::ios::out);
|
2021-11-10 15:21:32 +00:00
|
|
|
}
|
|
|
|
|
2022-05-19 11:00:02 +00:00
|
|
|
void V2XNode::publishCpmSenderObject(double x_mgrs, double y_mgrs, double orientation) {
|
|
|
|
autoware_auto_perception_msgs::msg::PredictedObjects cpm_sender_object_msg;
|
|
|
|
std_msgs::msg::Header header;
|
|
|
|
rclcpp::Time current_time = this->now();
|
|
|
|
cpm_sender_object_msg.header.frame_id = "map";
|
|
|
|
cpm_sender_object_msg.header.stamp = current_time;
|
|
|
|
|
|
|
|
autoware_auto_perception_msgs::msg::PredictedObject object;
|
|
|
|
autoware_auto_perception_msgs::msg::ObjectClassification classification;
|
|
|
|
autoware_auto_perception_msgs::msg::Shape shape;
|
|
|
|
autoware_auto_perception_msgs::msg::PredictedObjectKinematics kinematics;
|
|
|
|
|
|
|
|
classification.label = autoware_auto_perception_msgs::msg::ObjectClassification::CAR;
|
|
|
|
classification.probability = 0.99;
|
|
|
|
|
|
|
|
shape.type = autoware_auto_perception_msgs::msg::Shape::BOUNDING_BOX;
|
|
|
|
shape.dimensions.x = 5.0;
|
|
|
|
shape.dimensions.y = 2.0;
|
|
|
|
shape.dimensions.z = 1.7;
|
|
|
|
|
|
|
|
kinematics.initial_pose_with_covariance.pose.position.x = x_mgrs;
|
|
|
|
kinematics.initial_pose_with_covariance.pose.position.y = y_mgrs;
|
|
|
|
kinematics.initial_pose_with_covariance.pose.position.z = 0.1;
|
|
|
|
|
|
|
|
tf2::Quaternion quat;
|
|
|
|
quat.setRPY(0, 0, orientation);
|
|
|
|
|
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.x = quat.x();
|
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.y = quat.y();
|
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.z = quat.z();
|
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.w = quat.w();
|
|
|
|
|
|
|
|
object.classification.emplace_back(classification);
|
|
|
|
object.shape = shape;
|
|
|
|
object.kinematics = kinematics;
|
|
|
|
|
|
|
|
cpm_sender_object_msg.objects.push_back(object);
|
|
|
|
|
2022-11-03 07:43:43 +00:00
|
|
|
// publisher_v2x_cpm_sender_->publish(cpm_sender_object_msg);
|
2022-05-19 11:00:02 +00:00
|
|
|
|
|
|
|
}
|
|
|
|
|
2022-07-21 00:13:25 +00:00
|
|
|
void V2XNode::publishObjects(std::vector<CpmApplication::Object> *objectsStack, int cpm_num) {
|
2022-03-28 02:17:51 +00:00
|
|
|
autoware_auto_perception_msgs::msg::PredictedObjects output_dynamic_object_msg;
|
2021-11-10 15:21:32 +00:00
|
|
|
std_msgs::msg::Header header;
|
|
|
|
rclcpp::Time current_time = this->now();
|
|
|
|
output_dynamic_object_msg.header.frame_id = "map";
|
|
|
|
output_dynamic_object_msg.header.stamp = current_time;
|
|
|
|
|
|
|
|
for (CpmApplication::Object obj : *objectsStack) {
|
2022-03-28 02:17:51 +00:00
|
|
|
autoware_auto_perception_msgs::msg::PredictedObject object;
|
|
|
|
autoware_auto_perception_msgs::msg::ObjectClassification classification;
|
|
|
|
autoware_auto_perception_msgs::msg::Shape shape;
|
|
|
|
autoware_auto_perception_msgs::msg::PredictedObjectKinematics kinematics;
|
2021-11-10 15:21:32 +00:00
|
|
|
|
2022-03-28 02:17:51 +00:00
|
|
|
classification.label = autoware_auto_perception_msgs::msg::ObjectClassification::CAR;
|
|
|
|
classification.probability = 0.99;
|
2021-11-10 15:21:32 +00:00
|
|
|
|
2022-03-28 02:17:51 +00:00
|
|
|
shape.type = autoware_auto_perception_msgs::msg::Shape::BOUNDING_BOX;
|
2021-11-17 12:01:38 +00:00
|
|
|
shape.dimensions.x = obj.shape_x / 10.0;
|
|
|
|
shape.dimensions.y = obj.shape_y / 10.0;
|
|
|
|
shape.dimensions.z = obj.shape_z / 10.0;
|
2021-11-10 15:21:32 +00:00
|
|
|
|
2022-03-28 02:17:51 +00:00
|
|
|
kinematics.initial_pose_with_covariance.pose.position.x = obj.position_x;
|
|
|
|
kinematics.initial_pose_with_covariance.pose.position.y = obj.position_y;
|
|
|
|
kinematics.initial_pose_with_covariance.pose.position.z = 0.1;
|
2021-11-14 04:26:18 +00:00
|
|
|
|
2022-03-28 02:17:51 +00:00
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.x = obj.orientation_x;
|
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.y = obj.orientation_y;
|
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.z = obj.orientation_z;
|
|
|
|
kinematics.initial_pose_with_covariance.pose.orientation.w = obj.orientation_w;
|
2021-11-10 15:21:32 +00:00
|
|
|
|
2022-03-28 02:17:51 +00:00
|
|
|
object.classification.emplace_back(classification);
|
2021-11-10 15:21:32 +00:00
|
|
|
object.shape = shape;
|
2022-03-28 02:17:51 +00:00
|
|
|
object.kinematics = kinematics;
|
2021-11-10 15:21:32 +00:00
|
|
|
|
2022-09-14 07:14:44 +00:00
|
|
|
std::mt19937 gen(std::random_device{}());
|
|
|
|
std::independent_bits_engine<std::mt19937, 8, uint8_t> bit_eng(gen);
|
|
|
|
std::generate(object.object_id.uuid.begin(), object.object_id.uuid.end(), bit_eng);
|
|
|
|
|
2021-11-10 15:21:32 +00:00
|
|
|
output_dynamic_object_msg.objects.push_back(object);
|
|
|
|
}
|
2022-01-15 07:14:17 +00:00
|
|
|
|
2022-07-21 00:13:25 +00:00
|
|
|
std::chrono::milliseconds ms = std::chrono::duration_cast<std::chrono::milliseconds> (
|
|
|
|
std::chrono::system_clock::now().time_since_epoch()
|
|
|
|
);
|
|
|
|
latency_log_file << "T_publish," << cpm_num << "," << ms.count() << std::endl;
|
2022-01-15 07:14:17 +00:00
|
|
|
|
2022-11-03 07:43:43 +00:00
|
|
|
cpm_objects_pub_->publish(output_dynamic_object_msg);
|
2021-10-27 21:56:21 +00:00
|
|
|
}
|
|
|
|
|
2022-03-28 02:17:51 +00:00
|
|
|
void V2XNode::objectsCallback(const autoware_auto_perception_msgs::msg::PredictedObjects::ConstSharedPtr msg) {
|
2022-01-15 07:14:17 +00:00
|
|
|
rclcpp::Time msg_time = msg->header.stamp; // timestamp included in the Autoware Perception Msg.
|
2022-07-21 00:13:25 +00:00
|
|
|
|
|
|
|
std::chrono::milliseconds ms = std::chrono::duration_cast<std::chrono::milliseconds> (
|
|
|
|
std::chrono::system_clock::now().time_since_epoch()
|
|
|
|
);
|
|
|
|
latency_log_file << "T_rosmsg,," << ms.count() << std::endl;
|
|
|
|
|
2022-01-15 07:14:17 +00:00
|
|
|
app->objectsCallback(msg);
|
2021-10-27 21:56:21 +00:00
|
|
|
}
|
|
|
|
|
2022-01-15 07:14:17 +00:00
|
|
|
void V2XNode::tfCallback(const tf2_msgs::msg::TFMessage::ConstSharedPtr msg) {
|
2021-11-10 08:14:09 +00:00
|
|
|
app->tfCallback(msg);
|
2021-10-27 21:56:21 +00:00
|
|
|
}
|
2024-06-28 13:11:04 +00:00
|
|
|
|
2024-06-12 22:51:59 +00:00
|
|
|
void V2XNode::velocityReportCallback(const autoware_auto_vehicle_msgs::msg::VelocityReport::ConstSharedPtr msg) {
|
|
|
|
app->velocityReportCallback(msg);
|
|
|
|
}
|
2024-06-28 13:11:04 +00:00
|
|
|
|
2024-07-09 13:54:53 +00:00
|
|
|
void V2XNode::vehicleStatucCallback(const autoware_adapi_v1_msgs::msg::VehicleStatus::ConstSharedPtr msg) {
|
|
|
|
app->vehicleStatusCallback(msg);
|
2024-06-28 13:11:04 +00:00
|
|
|
}
|
|
|
|
|
2024-07-08 10:08:49 +00:00
|
|
|
void V2XNode::getVehicleDimensions() {
|
|
|
|
RCLCPP_INFO(get_logger(), "[V2XNode::getVehicleDimensions] Sending service request to /api/vehicle/dimensions");
|
|
|
|
auto request = std::make_shared<autoware_adapi_v1_msgs::srv::GetVehicleDimensions::Request>();
|
|
|
|
auto future_result = get_vehicle_dimensions_->async_send_request(request, [this](rclcpp::Client<autoware_adapi_v1_msgs::srv::GetVehicleDimensions>::SharedFuture future) {
|
|
|
|
try
|
|
|
|
{
|
|
|
|
auto response = future.get();
|
|
|
|
RCLCPP_INFO(get_logger(), "[V2XNode::getVehicleDimensions] Received response from /api/vehicle/dimensions");
|
|
|
|
try {
|
|
|
|
auto dimensions = response->dimensions;
|
|
|
|
if (dimensions.height == 0 || dimensions.wheel_base == 0 || dimensions.wheel_tread == 0)
|
|
|
|
this->getVehicleDimensions();
|
|
|
|
else
|
|
|
|
app->setVehicleDimensions(dimensions);
|
|
|
|
} catch (const std::exception &e) {
|
|
|
|
RCLCPP_ERROR(get_logger(), "[V2XNode::getVehicleDimensions] Service response of /api/vehicle/dimensions failed: %s", e.what());
|
|
|
|
}
|
|
|
|
}
|
|
|
|
catch (const std::exception &e)
|
|
|
|
{
|
|
|
|
RCLCPP_ERROR(get_logger(), "[V2XNode::getVehicleDimensions] Service call of /api/vehicle/dimensions failed: %s", e.what());
|
|
|
|
}
|
|
|
|
});
|
2024-06-12 22:51:59 +00:00
|
|
|
}
|
2021-10-27 21:56:21 +00:00
|
|
|
}
|
|
|
|
|
|
|
|
#include "rclcpp_components/register_node_macro.hpp"
|
2024-06-28 13:11:04 +00:00
|
|
|
RCLCPP_COMPONENTS_REGISTER_NODE(v2x::V2XNode)
|