#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>
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::Control * | g_control = NULL |
boost::shared_ptr< Driver_3DCS::Data > | g_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... | |
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.
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 | ) |
Driver_3DCS::Control* g_control = NULL |
boost::shared_ptr<Driver_3DCS::Data> g_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 |
const uint16_t NARE_DISTANCE_VALUE = 0xffffU |