Public Member Functions | Private Member Functions | Private Attributes | List of all members
rc::DepthPublisher Class Reference

#include <depth_publisher.h>

Inheritance diagram for rc::DepthPublisher:
Inheritance graph
[legend]

Public Member Functions

 DepthPublisher (ros::NodeHandle &nh, const std::string &frame_id_prefix, double f, double t, double scale)
 Initialization of publisher. More...
 
void publish (const rcg::Buffer *buffer, uint32_t part, uint64_t pixelformat) override
 Offers a buffer for publication. More...
 
bool used () override
 Returns true if there are subscribers to the topic. More...
 
- Public Member Functions inherited from rc::GenICam2RosPublisher
 GenICam2RosPublisher (const std::string &frame_id_prefix)
 
virtual ~GenICam2RosPublisher ()
 

Private Member Functions

 DepthPublisher (const DepthPublisher &)
 
DepthPublisheroperator= (const DepthPublisher &)
 

Private Attributes

ros::Publisher pub
 
float scale
 
uint32_t seq
 

Additional Inherited Members

- Protected Attributes inherited from rc::GenICam2RosPublisher
std::string frame_id
 

Detailed Description

Definition at line 44 of file depth_publisher.h.

Constructor & Destructor Documentation

rc::DepthPublisher::DepthPublisher ( ros::NodeHandle nh,
const std::string &  frame_id_prefix,
double  f,
double  t,
double  scale 
)

Initialization of publisher.

Parameters
nhNode handle.
fFocal length, normalized to image width of 1.
tBasline in m.
scaleFactor for raw disparities.

Definition at line 42 of file depth_publisher.cc.

rc::DepthPublisher::DepthPublisher ( const DepthPublisher )
private

Member Function Documentation

DepthPublisher& rc::DepthPublisher::operator= ( const DepthPublisher )
private
void rc::DepthPublisher::publish ( const rcg::Buffer buffer,
uint32_t  part,
uint64_t  pixelformat 
)
overridevirtual

Offers a buffer for publication.

It depends on the the kind of buffer data and the implementation and configuration of the sub-class if the data is published.

Parameters
bufferBuffer with data to be published.
partPart index of image.
pixelformatThe pixelformat as given by buffer.getPixelFormat().

Implements rc::GenICam2RosPublisher.

Definition at line 56 of file depth_publisher.cc.

bool rc::DepthPublisher::used ( )
overridevirtual

Returns true if there are subscribers to the topic.

Returns
True if there are subscribers.

Implements rc::GenICam2RosPublisher.

Definition at line 51 of file depth_publisher.cc.

Member Data Documentation

ros::Publisher rc::DepthPublisher::pub
private

Definition at line 69 of file depth_publisher.h.

float rc::DepthPublisher::scale
private

Definition at line 67 of file depth_publisher.h.

uint32_t rc::DepthPublisher::seq
private

Definition at line 66 of file depth_publisher.h.


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


rc_visard_driver
Author(s): Heiko Hirschmueller , Christian Emmerich , Felix Ruess
autogenerated on Sat Feb 13 2021 03:42:55