|
SMACC2
|
#include <cp_object_tracker_tf.hpp>
Public Member Functions | |
| CpObjectTrackerTf (std::string global_frame_id="map") | |
| void | setEnabled (bool enabled) |
| bool | isEnabled () |
| void | resetPoseEstimation () |
| void | update () override |
| void | onInitialize () |
| std::optional< geometry_msgs::msg::PoseStamped > | updateAndGetGlobalPose (const std::string &child_frame_id, const std::string &frame_id) |
Public Member Functions inherited from smacc2::ISmaccComponent | |
| ISmaccComponent () | |
| virtual | ~ISmaccComponent () |
| virtual std::string | getName () const |
Public Member Functions inherited from smacc2::ISmaccUpdatable | |
| ISmaccUpdatable () | |
| ISmaccUpdatable (rclcpp::Duration duration) | |
| void | executeUpdate (rclcpp::Node::SharedPtr node) |
| void | setUpdatePeriod (rclcpp::Duration duration) |
Private Attributes | |
| std::shared_ptr< tf2_ros::Buffer > | tfBuffer_ |
| std::shared_ptr< tf2_ros::TransformListener > | tfListener_ |
| std::shared_ptr< tf2_ros::TransformBroadcaster > | tfBroadcaster_ |
| std::string | global_frame_id_ |
| bool | enabled_ = false |
| std::map< std::string, DetectedObject > | detectedObjects |
| std::mutex | m_mutex_ |
Additional Inherited Members | |
Protected Member Functions inherited from smacc2::ISmaccComponent | |
| template<typename TOrthogonal , typename TClient > | |
| void | onComponentInitialization () |
| template<typename EventType > | |
| void | postEvent (const EventType &ev) |
| template<typename EventType > | |
| void | postEvent () |
| template<typename TOrthogonal , typename TSourceObject > | |
| void | onStateOrthogonalAllocation () |
| template<typename TComponent > | |
| void | requiresComponent (TComponent *&requiredComponentStorage, ComponentRequirement requirementType=ComponentRequirement::SOFT) |
| template<typename TComponent > | |
| void | requiresComponent (std::string name, TComponent *&requiredComponentStorage, ComponentRequirement requirementType=ComponentRequirement::SOFT) |
| template<typename TClient > | |
| void | requiresClient (TClient *&requiredClientStorage) |
| template<typename SmaccComponentType , typename TOrthogonal , typename TClient , typename... TArgs> | |
| SmaccComponentType * | createSiblingComponent (TArgs... targs) |
| template<typename SmaccComponentType , typename TOrthogonal , typename TClient , typename... TArgs> | |
| SmaccComponentType * | createSiblingNamedComponent (std::string name, TArgs... targs) |
| rclcpp::Node::SharedPtr | getNode () |
| rclcpp::Logger | getLogger () const |
| ISmaccStateMachine * | getStateMachine () |
Protected Member Functions inherited from smacc2::ISmaccUpdatable | |
Protected Attributes inherited from smacc2::ISmaccComponent | |
| ISmaccStateMachine * | stateMachine_ |
| ISmaccClient * | owner_ |
Definition at line 30 of file cp_object_tracker_tf.hpp.
|
inline |
Definition at line 45 of file cp_object_tracker_tf.hpp.
|
inline |
Definition at line 53 of file cp_object_tracker_tf.hpp.
References enabled_.
Referenced by cl_foundation_pose::CbTrackObjectPose::update().
|
inlinevirtual |
Reimplemented from smacc2::ISmaccComponent.
Definition at line 102 of file cp_object_tracker_tf.hpp.
References smacc2::ISmaccComponent::getNode(), tfBroadcaster_, tfBuffer_, and tfListener_.
|
inline |
Definition at line 55 of file cp_object_tracker_tf.hpp.
References detectedObjects, smacc2::ISmaccComponent::getLogger(), and m_mutex_.
Referenced by setEnabled().
|
inline |
Definition at line 47 of file cp_object_tracker_tf.hpp.
References enabled_, and resetPoseEstimation().
Referenced by cl_foundation_pose::CbTrackObjectPause::onEntry(), cl_foundation_pose::CbTrackObjectPose::onEntry(), cl_foundation_pose::CbTrackObjectPause::onExit(), and cl_foundation_pose::CbTrackObjectPose::onExit().
|
inlineoverridevirtual |
Implements smacc2::ISmaccUpdatable.
Definition at line 75 of file cp_object_tracker_tf.hpp.
References detectedObjects, enabled_, smacc2::ISmaccComponent::getLogger(), global_frame_id_, m_mutex_, and updateAndGetGlobalPose().
|
inline |
Definition at line 109 of file cp_object_tracker_tf.hpp.
References detectedObjects, cl_foundation_pose::DetectedObject::filtered_pose, smacc2::ISmaccComponent::getLogger(), cl_foundation_pose::DetectedObject::historicalPoses_, smacc2::ISmaccComponent::postEvent(), and tfBuffer_.
Referenced by cl_foundation_pose::CbTrackObjectPose::onEntry(), cl_foundation_pose::CbTrackObjectPose::update(), and update().
|
private |
Definition at line 41 of file cp_object_tracker_tf.hpp.
Referenced by resetPoseEstimation(), update(), and updateAndGetGlobalPose().
|
private |
Definition at line 38 of file cp_object_tracker_tf.hpp.
Referenced by isEnabled(), setEnabled(), and update().
|
private |
Definition at line 37 of file cp_object_tracker_tf.hpp.
Referenced by update().
|
private |
Definition at line 42 of file cp_object_tracker_tf.hpp.
Referenced by resetPoseEstimation(), and update().
|
private |
Definition at line 35 of file cp_object_tracker_tf.hpp.
Referenced by onInitialize().
|
private |
Definition at line 33 of file cp_object_tracker_tf.hpp.
Referenced by onInitialize(), and updateAndGetGlobalPose().
|
private |
Definition at line 34 of file cp_object_tracker_tf.hpp.
Referenced by onInitialize().