18 #ifndef COB_TWIST_CONTROLLER_COB_TWIST_CONTROLLER_H 19 #define COB_TWIST_CONTROLLER_COB_TWIST_CONTROLLER_H 23 #include <std_msgs/ColorRGBA.h> 24 #include <sensor_msgs/JointState.h> 25 #include <geometry_msgs/Twist.h> 26 #include <nav_msgs/Odometry.h> 31 #include <kdl/chainfksolvervel_recursive.hpp> 32 #include <kdl/jntarray.hpp> 33 #include <kdl/jntarrayvel.hpp> 34 #include <kdl/frames.hpp> 39 #include <boost/thread/mutex.hpp> 40 #include <boost/shared_ptr.hpp> 42 #include <dynamic_reconfigure/server.h> 45 #include <cob_twist_controller/TwistControllerConfig.h> 90 this->jntToCartSolver_vel_.reset();
91 this->p_inv_diff_kin_solver_.reset();
92 this->controller_interface_.reset();
105 void twistCallback(
const geometry_msgs::Twist::ConstPtr& msg);
115 #endif // COB_TWIST_CONTROLLER_COB_TWIST_CONTROLLER_H
KDL::Twist twist_odometry_cb_
void reconfigureCallback(cob_twist_controller::TwistControllerConfig &config, uint32_t level)
ros::Subscriber jointstate_sub_
CallbackDataMediator callback_data_mediator_
void jointstateCallback(const sensor_msgs::JointState::ConstPtr &msg)
void twistStampedCallback(const geometry_msgs::TwistStamped::ConstPtr &msg)
Orientation of twist_stamped_msg is with respect to coordinate system given in header.frame_id.
JointStates joint_states_
boost::shared_ptr< pluginlib::ClassLoader< cob_twist_controller::ControllerInterfaceBase > > interface_loader_
void odometryCallback(const nav_msgs::Odometry::ConstPtr &msg)
ros::Subscriber twist_stamped_sub_
tf::TransformListener tf_listener_
ros::ServiceClient register_link_client_
void solveTwist(KDL::Twist twist)
Orientation of twist is with respect to chain_base coordinate system.
boost::shared_ptr< KDL::ChainFkSolverVel_recursive > jntToCartSolver_vel_
ros::Subscriber odometry_sub_
ros::Publisher twist_direction_pub_
void twistCallback(const geometry_msgs::Twist::ConstPtr &msg)
Orientation of twist_msg is with respect to chain_base coordinate system.
bool registerCollisionLinks()
boost::shared_ptr< InverseDifferentialKinematicsSolver > p_inv_diff_kin_solver_
TwistControllerParams twist_controller_params_
ros::Subscriber twist_sub_
boost::shared_ptr< dynamic_reconfigure::Server< cob_twist_controller::TwistControllerConfig > > reconfigure_server_
ros::Subscriber obstacle_distance_sub_
boost::recursive_mutex reconfig_mutex_
void checkSolverAndConstraints(cob_twist_controller::TwistControllerConfig &config)
void visualizeTwist(KDL::Twist twist)
boost::shared_ptr< cob_twist_controller::ControllerInterfaceBase > controller_interface_