#include <assert.h>#include <sys/time.h>#include <unistd.h>#include <ros/ros.h>#include <tf/transform_datatypes.h>#include <tf2/LinearMath/Transform.h>#include <tf2_ros/buffer.h>#include <tf2_ros/transform_broadcaster.h>#include <tf2_ros/transform_listener.h>#include <tf2_geometry_msgs/tf2_geometry_msgs.h>#include <visualization_msgs/Marker.h>#include <image_transport/image_transport.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <list>#include <string>#include "fiducial_lib/File.hpp"#include "fiducial_lib/Fiducials.hpp"#include "fiducial_pose/rosrpp.h"#include "fiducial_pose/Fiducial.h"#include "fiducial_pose/FiducialTransform.h"#include "fiducial_pose/FiducialTransformArray.h"
Go to the source code of this file.
Classes | |
| class | FiducialsNode |
Functions | |
| int | main (int argc, char **argv) |
| tf2::Transform | msg_to_tf (geometry_msgs::TransformStamped &msg) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 592 of file fiducial_detect.cpp.
| tf2::Transform msg_to_tf | ( | geometry_msgs::TransformStamped & | msg | ) |
Definition at line 292 of file fiducial_detect.cpp.