Classes | Namespaces | Typedefs | Enumerations | Functions
pose_tracking.h File Reference
#include <atomic>
#include <boost/optional.hpp>
#include <control_toolbox/pid.h>
#include <moveit_servo/make_shared_from_pool.h>
#include <moveit_servo/servo.h>
#include <rosparam_shortcuts/rosparam_shortcuts.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <tf2_ros/transform_listener.h>
Include dependency graph for pose_tracking.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  moveit_servo::PIDConfig
 
class  moveit_servo::PoseTracking
 

Namespaces

 moveit_servo
 

Typedefs

using moveit_servo::PoseTrackingPtr = std::shared_ptr< PoseTracking >
 

Enumerations

enum  moveit_servo::PoseTrackingStatusCode : int8_t {
  moveit_servo::PoseTrackingStatusCode::INVALID = -1, moveit_servo::PoseTrackingStatusCode::SUCCESS = 0, moveit_servo::PoseTrackingStatusCode::NO_RECENT_TARGET_POSE = 1, moveit_servo::PoseTrackingStatusCode::NO_RECENT_END_EFFECTOR_POSE = 2,
  moveit_servo::PoseTrackingStatusCode::STOP_REQUESTED = 3
}
 

Functions

const std::unordered_map< PoseTrackingStatusCode, std::string > moveit_servo::POSE_TRACKING_STATUS_CODE_MAP ({ { PoseTrackingStatusCode::INVALID, "Invalid" }, { PoseTrackingStatusCode::SUCCESS, "Success" }, { PoseTrackingStatusCode::NO_RECENT_TARGET_POSE, "No recent target pose" }, { PoseTrackingStatusCode::NO_RECENT_END_EFFECTOR_POSE, "No recent end effector pose" }, { PoseTrackingStatusCode::STOP_REQUESTED, "Stop requested" } })
 


moveit_servo
Author(s): Brian O'Neil, Andy Zelenak , Blake Anderson, Alexander Rössler , Tyler Weaver
autogenerated on Sat May 3 2025 02:27:56