#include <pcl/point_types.h>
#include <unsupported/Eigen/MatrixFunctions>
#include <Eigen/Geometry>
#include <lgsm/Lgsm>
#include <boost/shared_ptr.hpp>
#include <boost/unordered_map.hpp>
#include <ros/ros.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Twist.h>
#include <geometry_msgs/PoseWithCovariance.h>
#include <tf/tf.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_broadcaster.h>
#include <tf_conversions/tf_eigen.h>
#include <visualization_msgs/MarkerArray.h>
#include <wrappers/matrix/matrix_wrapper.h>
#include "omip_msgs/RigidBodyTwistWithCovMsg.h"
#include "omip_common/OMIPTypeDefs.h"
#include "geometry_msgs/PoseWithCovarianceStamped.h"
Go to the source code of this file.
#define JOINT_AXIS_AND_VARIABLE_MARKER_RADIUS 0.02 |
#define JOINT_AXIS_MARKER_RADIUS 0.01 |
#define JOINT_VALUE_TEXT_SIZE 0.1 |