Functions | Variables
visionary_t_mini.cpp File Reference
#include <boost/thread.hpp>
#include <cv_bridge/cv_bridge.h>
#include <image_transport/image_transport.h>
#include <ros/ros.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/LaserScan.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/image_encodings.h>
#include <std_msgs/ByteMultiArray.h>
#include <memory>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include "VisionaryControl.h"
#include "VisionaryDataStream.h"
#include "VisionaryTMiniData.h"
Include dependency graph for visionary_t_mini.cpp:

Go to the source code of this file.

Functions

void _on_new_subscriber ()
 
void _on_subscriber_disconnected ()
 
void diag_timer_cb (const ros::TimerEvent &)
 
void driver_diagnostics (diagnostic_updater::DiagnosticStatusWrapper &stat)
 
int main (int argc, char **argv)
 
void on_new_subscriber_it (const image_transport::SingleSubscriberPublisher &)
 
void on_new_subscriber_ros (const ros::SingleSubscriberPublisher &)
 
void on_subscriber_disconnected_it (const image_transport::SingleSubscriberPublisher &)
 
void on_subscriber_disconnected_ros (const ros::SingleSubscriberPublisher &)
 
void publish_frame (VisionaryTMiniData &dataHandler)
 
void publishCameraInfo (std_msgs::Header header, VisionaryTMiniData &dataHandler)
 
void publishDepth (std_msgs::Header header, VisionaryTMiniData &dataHandler)
 
void publishIntensity (std_msgs::Header header, VisionaryTMiniData &dataHandler)
 
void publishPointCloud (std_msgs::Header header, VisionaryTMiniData &dataHandler)
 
void publishStateMap (std_msgs::Header header, VisionaryTMiniData &dataHandler)
 
void thr_publish_frame ()
 
void thr_receive_frame (std::shared_ptr< VisionaryDataStream > pDataStream, std::shared_ptr< VisionaryTMiniData > pDataHandler)
 

Variables

std::shared_ptr< VisionaryControlgControl
 
std::shared_ptr< VisionaryTMiniDatagDataHandler
 
boost::mutex gDataMtx
 
std::string gDeviceIdent
 
bool gEnableDepth
 
bool gEnableIntensity
 
bool gEnablePoints
 
bool gEnableStatemap
 
std::string gFrameId
 
int gNumSubs = 0
 
ros::Publisher gPubCameraInfo
 
std::shared_ptr< diagnostic_updater::TopicDiagnosticgPubCameraInfo_freq
 
image_transport::Publisher gPubDepth
 
std::shared_ptr< diagnostic_updater::TopicDiagnosticgPubDepth_freq
 
image_transport::Publisher gPubIntensity
 
std::shared_ptr< diagnostic_updater::TopicDiagnosticgPubIntensity_freq
 
ros::Publisher gPubPoints
 
std::shared_ptr< diagnostic_updater::TopicDiagnosticgPubPoints_freq
 
image_transport::Publisher gPubStatemap
 
std::shared_ptr< diagnostic_updater::TopicDiagnosticgPubStatemap_freq
 
bool gReceive = true
 
std::shared_ptr< diagnostic_updater::Updaterupdater
 

Function Documentation

◆ _on_new_subscriber()

void _on_new_subscriber ( )

Definition at line 283 of file visionary_t_mini.cpp.

◆ _on_subscriber_disconnected()

void _on_subscriber_disconnected ( )

Definition at line 291 of file visionary_t_mini.cpp.

◆ diag_timer_cb()

void diag_timer_cb ( const ros::TimerEvent )

Definition at line 46 of file visionary_t_mini.cpp.

◆ driver_diagnostics()

void driver_diagnostics ( diagnostic_updater::DiagnosticStatusWrapper stat)

Definition at line 51 of file visionary_t_mini.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 317 of file visionary_t_mini.cpp.

◆ on_new_subscriber_it()

void on_new_subscriber_it ( const image_transport::SingleSubscriberPublisher )

Definition at line 302 of file visionary_t_mini.cpp.

◆ on_new_subscriber_ros()

void on_new_subscriber_ros ( const ros::SingleSubscriberPublisher )

Definition at line 297 of file visionary_t_mini.cpp.

◆ on_subscriber_disconnected_it()

void on_subscriber_disconnected_it ( const image_transport::SingleSubscriberPublisher )

Definition at line 312 of file visionary_t_mini.cpp.

◆ on_subscriber_disconnected_ros()

void on_subscriber_disconnected_ros ( const ros::SingleSubscriberPublisher )

Definition at line 307 of file visionary_t_mini.cpp.

◆ publish_frame()

void publish_frame ( VisionaryTMiniData dataHandler)

Definition at line 197 of file visionary_t_mini.cpp.

◆ publishCameraInfo()

void publishCameraInfo ( std_msgs::Header  header,
VisionaryTMiniData dataHandler 
)

Definition at line 71 of file visionary_t_mini.cpp.

◆ publishDepth()

void publishDepth ( std_msgs::Header  header,
VisionaryTMiniData dataHandler 
)

Definition at line 109 of file visionary_t_mini.cpp.

◆ publishIntensity()

void publishIntensity ( std_msgs::Header  header,
VisionaryTMiniData dataHandler 
)

Definition at line 121 of file visionary_t_mini.cpp.

◆ publishPointCloud()

void publishPointCloud ( std_msgs::Header  header,
VisionaryTMiniData dataHandler 
)

Definition at line 145 of file visionary_t_mini.cpp.

◆ publishStateMap()

void publishStateMap ( std_msgs::Header  header,
VisionaryTMiniData dataHandler 
)

Definition at line 133 of file visionary_t_mini.cpp.

◆ thr_publish_frame()

void thr_publish_frame ( )

Definition at line 256 of file visionary_t_mini.cpp.

◆ thr_receive_frame()

void thr_receive_frame ( std::shared_ptr< VisionaryDataStream pDataStream,
std::shared_ptr< VisionaryTMiniData pDataHandler 
)

Definition at line 263 of file visionary_t_mini.cpp.

Variable Documentation

◆ gControl

std::shared_ptr<VisionaryControl> gControl

Definition at line 26 of file visionary_t_mini.cpp.

◆ gDataHandler

std::shared_ptr<VisionaryTMiniData> gDataHandler

Definition at line 28 of file visionary_t_mini.cpp.

◆ gDataMtx

boost::mutex gDataMtx

Definition at line 41 of file visionary_t_mini.cpp.

◆ gDeviceIdent

std::string gDeviceIdent

Definition at line 38 of file visionary_t_mini.cpp.

◆ gEnableDepth

bool gEnableDepth

Definition at line 39 of file visionary_t_mini.cpp.

◆ gEnableIntensity

bool gEnableIntensity

Definition at line 39 of file visionary_t_mini.cpp.

◆ gEnablePoints

bool gEnablePoints

Definition at line 39 of file visionary_t_mini.cpp.

◆ gEnableStatemap

bool gEnableStatemap

Definition at line 39 of file visionary_t_mini.cpp.

◆ gFrameId

std::string gFrameId

Definition at line 37 of file visionary_t_mini.cpp.

◆ gNumSubs

int gNumSubs = 0

Definition at line 44 of file visionary_t_mini.cpp.

◆ gPubCameraInfo

ros::Publisher gPubCameraInfo

Definition at line 31 of file visionary_t_mini.cpp.

◆ gPubCameraInfo_freq

std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubCameraInfo_freq

Definition at line 35 of file visionary_t_mini.cpp.

◆ gPubDepth

Definition at line 30 of file visionary_t_mini.cpp.

◆ gPubDepth_freq

std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubDepth_freq

Definition at line 34 of file visionary_t_mini.cpp.

◆ gPubIntensity

Definition at line 30 of file visionary_t_mini.cpp.

◆ gPubIntensity_freq

std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubIntensity_freq

Definition at line 34 of file visionary_t_mini.cpp.

◆ gPubPoints

ros::Publisher gPubPoints

Definition at line 31 of file visionary_t_mini.cpp.

◆ gPubPoints_freq

std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubPoints_freq

Definition at line 35 of file visionary_t_mini.cpp.

◆ gPubStatemap

Definition at line 30 of file visionary_t_mini.cpp.

◆ gPubStatemap_freq

std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubStatemap_freq

Definition at line 34 of file visionary_t_mini.cpp.

◆ gReceive

bool gReceive = true

Definition at line 42 of file visionary_t_mini.cpp.

◆ updater

std::shared_ptr<diagnostic_updater::Updater> updater

Definition at line 33 of file visionary_t_mini.cpp.



sick_visionary_ros
Author(s): SICK AG TechSupport 3D Snapshot
autogenerated on Thu Feb 8 2024 03:56:22