#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"
Go to the source code of this file.
Variables | |
std::shared_ptr< VisionaryControl > | gControl |
std::shared_ptr< VisionaryTMiniData > | gDataHandler |
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::TopicDiagnostic > | gPubCameraInfo_freq |
image_transport::Publisher | gPubDepth |
std::shared_ptr< diagnostic_updater::TopicDiagnostic > | gPubDepth_freq |
image_transport::Publisher | gPubIntensity |
std::shared_ptr< diagnostic_updater::TopicDiagnostic > | gPubIntensity_freq |
ros::Publisher | gPubPoints |
std::shared_ptr< diagnostic_updater::TopicDiagnostic > | gPubPoints_freq |
image_transport::Publisher | gPubStatemap |
std::shared_ptr< diagnostic_updater::TopicDiagnostic > | gPubStatemap_freq |
bool | gReceive = true |
std::shared_ptr< diagnostic_updater::Updater > | updater |
void _on_new_subscriber | ( | ) |
Definition at line 283 of file visionary_t_mini.cpp.
void _on_subscriber_disconnected | ( | ) |
Definition at line 291 of file visionary_t_mini.cpp.
void diag_timer_cb | ( | const ros::TimerEvent & | ) |
Definition at line 46 of file visionary_t_mini.cpp.
void driver_diagnostics | ( | diagnostic_updater::DiagnosticStatusWrapper & | stat | ) |
Definition at line 51 of file visionary_t_mini.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 317 of file visionary_t_mini.cpp.
void on_new_subscriber_it | ( | const image_transport::SingleSubscriberPublisher & | ) |
Definition at line 302 of file visionary_t_mini.cpp.
void on_new_subscriber_ros | ( | const ros::SingleSubscriberPublisher & | ) |
Definition at line 297 of file visionary_t_mini.cpp.
void on_subscriber_disconnected_it | ( | const image_transport::SingleSubscriberPublisher & | ) |
Definition at line 312 of file visionary_t_mini.cpp.
void on_subscriber_disconnected_ros | ( | const ros::SingleSubscriberPublisher & | ) |
Definition at line 307 of file visionary_t_mini.cpp.
void publish_frame | ( | VisionaryTMiniData & | dataHandler | ) |
Definition at line 197 of file visionary_t_mini.cpp.
void publishCameraInfo | ( | std_msgs::Header | header, |
VisionaryTMiniData & | dataHandler | ||
) |
Definition at line 71 of file visionary_t_mini.cpp.
void publishDepth | ( | std_msgs::Header | header, |
VisionaryTMiniData & | dataHandler | ||
) |
Definition at line 109 of file visionary_t_mini.cpp.
void publishIntensity | ( | std_msgs::Header | header, |
VisionaryTMiniData & | dataHandler | ||
) |
Definition at line 121 of file visionary_t_mini.cpp.
void publishPointCloud | ( | std_msgs::Header | header, |
VisionaryTMiniData & | dataHandler | ||
) |
Definition at line 145 of file visionary_t_mini.cpp.
void publishStateMap | ( | std_msgs::Header | header, |
VisionaryTMiniData & | dataHandler | ||
) |
Definition at line 133 of file visionary_t_mini.cpp.
void thr_publish_frame | ( | ) |
Definition at line 256 of file visionary_t_mini.cpp.
void thr_receive_frame | ( | std::shared_ptr< VisionaryDataStream > | pDataStream, |
std::shared_ptr< VisionaryTMiniData > | pDataHandler | ||
) |
Definition at line 263 of file visionary_t_mini.cpp.
std::shared_ptr<VisionaryControl> gControl |
Definition at line 26 of file visionary_t_mini.cpp.
std::shared_ptr<VisionaryTMiniData> gDataHandler |
Definition at line 28 of file visionary_t_mini.cpp.
boost::mutex gDataMtx |
Definition at line 41 of file visionary_t_mini.cpp.
std::string gDeviceIdent |
Definition at line 38 of file visionary_t_mini.cpp.
bool gEnableDepth |
Definition at line 39 of file visionary_t_mini.cpp.
bool gEnableIntensity |
Definition at line 39 of file visionary_t_mini.cpp.
bool gEnablePoints |
Definition at line 39 of file visionary_t_mini.cpp.
bool gEnableStatemap |
Definition at line 39 of file visionary_t_mini.cpp.
std::string gFrameId |
Definition at line 37 of file visionary_t_mini.cpp.
int gNumSubs = 0 |
Definition at line 44 of file visionary_t_mini.cpp.
ros::Publisher gPubCameraInfo |
Definition at line 31 of file visionary_t_mini.cpp.
std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubCameraInfo_freq |
Definition at line 35 of file visionary_t_mini.cpp.
image_transport::Publisher gPubDepth |
Definition at line 30 of file visionary_t_mini.cpp.
std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubDepth_freq |
Definition at line 34 of file visionary_t_mini.cpp.
image_transport::Publisher gPubIntensity |
Definition at line 30 of file visionary_t_mini.cpp.
std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubIntensity_freq |
Definition at line 34 of file visionary_t_mini.cpp.
ros::Publisher gPubPoints |
Definition at line 31 of file visionary_t_mini.cpp.
std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubPoints_freq |
Definition at line 35 of file visionary_t_mini.cpp.
image_transport::Publisher gPubStatemap |
Definition at line 30 of file visionary_t_mini.cpp.
std::shared_ptr<diagnostic_updater::TopicDiagnostic> gPubStatemap_freq |
Definition at line 34 of file visionary_t_mini.cpp.
bool gReceive = true |
Definition at line 42 of file visionary_t_mini.cpp.
std::shared_ptr<diagnostic_updater::Updater> updater |
Definition at line 33 of file visionary_t_mini.cpp.