Public Member Functions | Private Attributes | List of all members
ensenso_camera::VirtualObjectHandler Class Reference

#include <virtual_object_handler.h>

Public Member Functions

void updateObjectLinks ()
 
 VirtualObjectHandler (ensenso::ros::NodeHandle &nh, const std::string &filename, const std::string &objectsFrame, const std::string &linkFrame, const std::string &markerTopic, double markerPublishRate)
 
 ~VirtualObjectHandler ()
 

Private Attributes

std::string linkFrame
 Link frame where NxLib expects the objects to be defined. More...
 
std::thread markerThread
 Background thread used to publish object markers. More...
 
std::string objectsFrame
 Frame in which objects are defined. More...
 
std::vector< tf2::TransformoriginalTransforms
 Original object transforms in the base frame. More...
 
std::atomic_bool stopMarkerThread { false }
 Flag to indicate markerThread should stop. More...
 
tf2_ros::Buffer tfBuffer
 
tf2_ros::TransformListener tfListener { tfBuffer }
 

Detailed Description

Definition at line 15 of file virtual_object_handler.h.

Constructor & Destructor Documentation

◆ VirtualObjectHandler()

VirtualObjectHandler::VirtualObjectHandler ( ensenso::ros::NodeHandle nh,
const std::string &  filename,
const std::string &  objectsFrame,
const std::string &  linkFrame,
const std::string &  markerTopic,
double  markerPublishRate 
)

Definition at line 161 of file virtual_object_handler.cpp.

◆ ~VirtualObjectHandler()

VirtualObjectHandler::~VirtualObjectHandler ( )

Definition at line 187 of file virtual_object_handler.cpp.

Member Function Documentation

◆ updateObjectLinks()

void VirtualObjectHandler::updateObjectLinks ( )

Definition at line 197 of file virtual_object_handler.cpp.

Member Data Documentation

◆ linkFrame

std::string ensenso_camera::VirtualObjectHandler::linkFrame
private

Link frame where NxLib expects the objects to be defined.

Definition at line 32 of file virtual_object_handler.h.

◆ markerThread

std::thread ensenso_camera::VirtualObjectHandler::markerThread
private

Background thread used to publish object markers.

Definition at line 25 of file virtual_object_handler.h.

◆ objectsFrame

std::string ensenso_camera::VirtualObjectHandler::objectsFrame
private

Frame in which objects are defined.

Definition at line 31 of file virtual_object_handler.h.

◆ originalTransforms

std::vector<tf2::Transform> ensenso_camera::VirtualObjectHandler::originalTransforms
private

Original object transforms in the base frame.

Definition at line 29 of file virtual_object_handler.h.

◆ stopMarkerThread

std::atomic_bool ensenso_camera::VirtualObjectHandler::stopMarkerThread { false }
private

Flag to indicate markerThread should stop.

Definition at line 26 of file virtual_object_handler.h.

◆ tfBuffer

tf2_ros::Buffer ensenso_camera::VirtualObjectHandler::tfBuffer
private

Definition at line 34 of file virtual_object_handler.h.

◆ tfListener

tf2_ros::TransformListener ensenso_camera::VirtualObjectHandler::tfListener { tfBuffer }
private

Definition at line 35 of file virtual_object_handler.h.


The documentation for this class was generated from the following files:


ensenso_camera
Author(s): Ensenso
autogenerated on Wed Apr 2 2025 02:37:46