Public Slots | Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
Transformation_Publisher Class Reference

#include <transformation_publisher.h>

Inheritance diagram for Transformation_Publisher:
Inheritance graph
[legend]

Public Slots

void newTransform_Camera (const Eigen::Matrix4d &transform, Markertype markertype)
 
void newTransform_Laserscan (const Eigen::Matrix4d &transform, double distanceToTop)
 

Public Member Functions

void stop ()
 
 Transformation_Publisher (boost::shared_ptr< Calibration_Object > object)
 

Protected Member Functions

geometry_msgs::Transform matrixToTransform (const Eigen::Matrix4d &matrix)
 
void run ()
 

Protected Attributes

tf::TransformBroadcaster broadcaster
 
Markertype currentMarkertype
 
ros::Publisher joint_pub
 
geometry_msgs::TransformStamped mapToTop
 
geometry_msgs::TransformStamped markerLeftToCamera
 
geometry_msgs::TransformStamped markerRightToCamera
 
ros::NodeHandle nh
 
std::vector< geometry_msgs::TransformStamped > staticTransforms
 
geometry_msgs::TransformStamped topToScanFrame
 

Detailed Description

Definition at line 39 of file transformation_publisher.h.

Constructor & Destructor Documentation

Transformation_Publisher::Transformation_Publisher ( boost::shared_ptr< Calibration_Object object)
explicit

Copyright (c) 2016, Aumann Florian, Heller Florian, Meißner Pascal All rights reserved.

Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met:

  1. Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer.
  2. Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution.
  3. Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission.

THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.

Definition at line 24 of file transformation_publisher.cpp.

Member Function Documentation

geometry_msgs::Transform Transformation_Publisher::matrixToTransform ( const Eigen::Matrix4d &  matrix)
protected

Definition at line 140 of file transformation_publisher.cpp.

void Transformation_Publisher::newTransform_Camera ( const Eigen::Matrix4d &  transform,
Markertype  markertype 
)
slot

Definition at line 79 of file transformation_publisher.cpp.

void Transformation_Publisher::newTransform_Laserscan ( const Eigen::Matrix4d &  transform,
double  distanceToTop 
)
slot

Definition at line 66 of file transformation_publisher.cpp.

void Transformation_Publisher::run ( )
protected

Definition at line 100 of file transformation_publisher.cpp.

void Transformation_Publisher::stop ( )

Member Data Documentation

tf::TransformBroadcaster Transformation_Publisher::broadcaster
protected

Definition at line 51 of file transformation_publisher.h.

Markertype Transformation_Publisher::currentMarkertype
protected

Definition at line 59 of file transformation_publisher.h.

ros::Publisher Transformation_Publisher::joint_pub
protected

Definition at line 50 of file transformation_publisher.h.

geometry_msgs::TransformStamped Transformation_Publisher::mapToTop
protected

Definition at line 54 of file transformation_publisher.h.

geometry_msgs::TransformStamped Transformation_Publisher::markerLeftToCamera
protected

Definition at line 56 of file transformation_publisher.h.

geometry_msgs::TransformStamped Transformation_Publisher::markerRightToCamera
protected

Definition at line 57 of file transformation_publisher.h.

ros::NodeHandle Transformation_Publisher::nh
protected

Definition at line 49 of file transformation_publisher.h.

std::vector<geometry_msgs::TransformStamped> Transformation_Publisher::staticTransforms
protected

Definition at line 53 of file transformation_publisher.h.

geometry_msgs::TransformStamped Transformation_Publisher::topToScanFrame
protected

Definition at line 55 of file transformation_publisher.h.


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


asr_mild_calibration_tool
Author(s): Aumann Florian, Heller Florian, Meißner Pascal
autogenerated on Mon Dec 2 2019 03:11:43