Functions | Variables
node.cpp File Reference
#include <sick_visionary_t_driver/driver.h>
#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <sensor_msgs/image_encodings.h>
#include <sensor_msgs/PointCloud2.h>
#include <cv_bridge/cv_bridge.h>
#include <boost/thread.hpp>
#include <sensor_msgs/CameraInfo.h>
#include <std_msgs/ByteMultiArray.h>
Include dependency graph for node.cpp:

Go to the source code of this file.

Functions

void _on_new_subscriber ()
 
int main (int argc, char **argv)
 
void on_frame (const boost::shared_ptr< Driver_3DCS::Data > &data)
 
void on_new_subscriber_it (const image_transport::SingleSubscriberPublisher &pub)
 
void on_new_subscriber_ros (const ros::SingleSubscriberPublisher &pub)
 
void publish_frame (const Driver_3DCS::Data &data)
 
void thr_publish_frame ()
 

Variables

Driver_3DCS::Controlg_control = NULL
 
boost::shared_ptr< Driver_3DCS::Datag_data
 
std::string g_frame_id
 
boost::mutex g_mtx_data
 
ros::Publisher g_pub_camera_info
 
image_transport::Publisher g_pub_confidence
 
image_transport::Publisher g_pub_depth
 
image_transport::Publisher g_pub_intensity
 
ros::Publisher g_pub_ios
 
ros::Publisher g_pub_points
 
bool g_publish_all = false
 If true: prevents skipping of frames and publish everything, otherwise use newest data to publish to ROS world. More...
 
const uint16_t NARE_DISTANCE_VALUE = 0xffffU
 Distance code for data outside the TOF range. More...
 
const bool SUPPRESS_INVALID_POINTS = true
 Flag whether invalid points are to be replaced by NaN. More...
 

Detailed Description

Note
Copyright (c) 2015
Fraunhofer Institute for Manufacturing Engineering and Automation (IPA)

Copyright (c) 2015
SICK AG

ROS package name: sick_visionary_t_driver
Author
Author: Joshua Hampp
Date
Date of creation: 05/21/2015

Licensed under the Apache License, Version 2.0 (the "License"); you may not use this file except in compliance with the License. You may obtain a copy of the License at

http://www.apache.org/licenses/LICENSE-2.0

Unless required by applicable law or agreed to in writing, software distributed under the License is distributed on an "AS IS" BASIS, WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. See the License for the specific language governing permissions and limitations under the License.

Definition in file node.cpp.

Function Documentation

void _on_new_subscriber ( )

Definition at line 234 of file node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 251 of file node.cpp.

void on_frame ( const boost::shared_ptr< Driver_3DCS::Data > &  data)

Definition at line 74 of file node.cpp.

void on_new_subscriber_it ( const image_transport::SingleSubscriberPublisher pub)

Definition at line 247 of file node.cpp.

void on_new_subscriber_ros ( const ros::SingleSubscriberPublisher pub)

Definition at line 243 of file node.cpp.

void publish_frame ( const Driver_3DCS::Data data)

Definition at line 90 of file node.cpp.

void thr_publish_frame ( )

Definition at line 68 of file node.cpp.

Variable Documentation

Driver_3DCS::Control* g_control = NULL

Definition at line 58 of file node.cpp.

Definition at line 64 of file node.cpp.

std::string g_frame_id

Definition at line 59 of file node.cpp.

boost::mutex g_mtx_data

Definition at line 63 of file node.cpp.

ros::Publisher g_pub_camera_info

Definition at line 57 of file node.cpp.

image_transport::Publisher g_pub_confidence

Definition at line 56 of file node.cpp.

Definition at line 56 of file node.cpp.

image_transport::Publisher g_pub_intensity

Definition at line 56 of file node.cpp.

ros::Publisher g_pub_ios

Definition at line 57 of file node.cpp.

ros::Publisher g_pub_points

Definition at line 57 of file node.cpp.

bool g_publish_all = false

If true: prevents skipping of frames and publish everything, otherwise use newest data to publish to ROS world.

Definition at line 61 of file node.cpp.

const uint16_t NARE_DISTANCE_VALUE = 0xffffU

Distance code for data outside the TOF range.

Definition at line 55 of file node.cpp.

const bool SUPPRESS_INVALID_POINTS = true

Flag whether invalid points are to be replaced by NaN.

Definition at line 52 of file node.cpp.



sick_visionary_t_driver
Author(s): Joshua Hampp
autogenerated on Mon Jun 10 2019 15:09:27