Carma-platform v4.2.0
CARMA Platform is built on robot operating system (ROS) and utilizes open source software (OSS) that enables Cooperative Driving Automation (CDA) features to allow Automated Driving Systems to interact and cooperate with infrastructure and other vehicles through communication.
|
#include <object_detection_tracking_worker.h>
Public Types | |
using | PublishObjectCallback = std::function< void(const carma_perception_msgs::msg::ExternalObjectList &)> |
using | TransformLookupCallback = std::function< boost::optional< geometry_msgs::msg::TransformStamped >(const std::string &, const std::string &, const rclcpp::Time &stamp)> |
Public Member Functions | |
ObjectDetectionTrackingWorker (PublishObjectCallback obj_pub, TransformLookupCallback tf_lookup, rclcpp::node_interfaces::NodeLoggingInterface::SharedPtr logger) | |
Constructor. More... | |
void | detectedObjectCallback (autoware_auto_msgs::msg::TrackedObjects::UniquePtr msg) |
detectedObjectCallback populates detected object along with its velocity,yaw, yaw_rate and static/dynamic class to DetectedObject message. More... | |
void | setMapFrame (std::string map_frame) |
Private Member Functions | |
bool | isClass (const autoware_auto_msgs::msg::TrackedObject &obj, uint8_t class_id) |
Helper method to check if the provided tracked object has the provided class type. More... | |
Private Attributes | |
PublishObjectCallback | obj_pub_ |
TransformLookupCallback | tf_lookup_ |
std::string | map_frame_ = "map" |
rclcpp::node_interfaces::NodeLoggingInterface::SharedPtr | logger_ |
Definition at line 38 of file object_detection_tracking_worker.h.
using object::ObjectDetectionTrackingWorker::PublishObjectCallback = std::function<void(const carma_perception_msgs::msg::ExternalObjectList&)> |
Definition at line 43 of file object_detection_tracking_worker.h.
using object::ObjectDetectionTrackingWorker::TransformLookupCallback = std::function<boost::optional<geometry_msgs::msg::TransformStamped>(const std::string&, const std::string&, const rclcpp::Time& stamp)> |
Function which will return the most recent transform between the provided frames First frame is target second is source If the transform does not exist or cannot be computed the optional returns false
Definition at line 50 of file object_detection_tracking_worker.h.
object::ObjectDetectionTrackingWorker::ObjectDetectionTrackingWorker | ( | PublishObjectCallback | obj_pub, |
TransformLookupCallback | tf_lookup, | ||
rclcpp::node_interfaces::NodeLoggingInterface::SharedPtr | logger | ||
) |
Constructor.
Definition at line 28 of file object_detection_tracking_worker.cpp.
void object::ObjectDetectionTrackingWorker::detectedObjectCallback | ( | autoware_auto_msgs::msg::TrackedObjects::UniquePtr | msg | ) |
detectedObjectCallback populates detected object along with its velocity,yaw, yaw_rate and static/dynamic class to DetectedObject message.
msg | array of detected objects. |
Definition at line 39 of file object_detection_tracking_worker.cpp.
References process_bag::i, isClass(), logger_, map_frame_, obj_pub_, process_traj_logs::point, tf_lookup_, covariance_helper::transformCovariance(), and process_traj_logs::xy.
Referenced by object::ObjectDetectionTrackingNode::handle_on_configure().
|
private |
Helper method to check if the provided tracked object has the provided class type.
obj | The object to check |
class_id | The class type to check |
Definition at line 31 of file object_detection_tracking_worker.cpp.
Referenced by detectedObjectCallback().
void object::ObjectDetectionTrackingWorker::setMapFrame | ( | std::string | map_frame | ) |
Definition at line 213 of file object_detection_tracking_worker.cpp.
References map_frame_.
Referenced by object::ObjectDetectionTrackingNode::handle_on_configure().
|
private |
Definition at line 84 of file object_detection_tracking_worker.h.
Referenced by detectedObjectCallback().
|
private |
Definition at line 81 of file object_detection_tracking_worker.h.
Referenced by detectedObjectCallback(), and setMapFrame().
|
private |
Definition at line 74 of file object_detection_tracking_worker.h.
Referenced by detectedObjectCallback().
|
private |
Definition at line 78 of file object_detection_tracking_worker.h.
Referenced by detectedObjectCallback().