#include <wrench_manager.hpp>
|
bool | initializeWrenchComm (const std::string &end_effector, const std::string &sensor_frame, const std::string &gripping_point_frame, const std::string &sensor_topic, const std::string &calib_matrix_param) |
|
bool | wrenchAtGrippingPoint (const std::string &end_effector, Eigen::Matrix< double, 6, 1 > &wrench) const |
|
bool | wrenchAtSensorPoint (const std::string &end_effector, Eigen::Matrix< double, 6, 1 > &wrench) const |
|
| WrenchManager (ros::NodeHandle nh_=ros::NodeHandle("~")) |
|
| ~WrenchManager () |
|
| ManagerBase () |
|
virtual | ~ManagerBase () |
|
|
void | forceTorqueCB (const geometry_msgs::WrenchStamped::ConstPtr &msg) |
|
Subscribes to wrench topics and produces the wrench value at a requested frame.
Definition at line 21 of file wrench_manager.hpp.
generic_control_toolbox::WrenchManager::~WrenchManager |
( |
| ) |
|
void generic_control_toolbox::WrenchManager::forceTorqueCB |
( |
const geometry_msgs::WrenchStamped::ConstPtr & |
msg | ) |
|
|
private |
Obtains wrench measurements for a force torque sensor.
- Parameters
-
msg | The force torque message from the sensor node. |
Definition at line 137 of file wrench_manager.cpp.
bool generic_control_toolbox::WrenchManager::initializeWrenchComm |
( |
const std::string & |
end_effector, |
|
|
const std::string & |
sensor_frame, |
|
|
const std::string & |
gripping_point_frame, |
|
|
const std::string & |
sensor_topic, |
|
|
const std::string & |
calib_matrix_param |
|
) |
| |
Adds a new wrench subscription. The wrench manager stores the rigid transform between the F/T sensor and the gripping point.
- Parameters
-
end_effector | The sensor arm's end-effector. |
sensor_frame | The TF frame name that represents the sensor pose. |
gripping_point_frame | The TF frame that represents the gripping point pose. |
sensor_topic | The wrench topic name for the desired sensor. |
- Returns
- False if something goes wrong, true otherwise.
Definition at line 17 of file wrench_manager.cpp.
bool generic_control_toolbox::WrenchManager::wrenchAtGrippingPoint |
( |
const std::string & |
end_effector, |
|
|
Eigen::Matrix< double, 6, 1 > & |
wrench |
|
) |
| const |
Provides access to the measured wrench at the arm's gripping point. Wrench is expressed in the point's frame.
- Parameters
-
end_effector | The arm's end-effector name. |
wrench | The wrench at the gripping point. |
- Returns
- false in case of error, true otherwise.
Definition at line 101 of file wrench_manager.cpp.
bool generic_control_toolbox::WrenchManager::wrenchAtSensorPoint |
( |
const std::string & |
end_effector, |
|
|
Eigen::Matrix< double, 6, 1 > & |
wrench |
|
) |
| const |
Gets the original sensor measurements, at the sensor frame.
- Parameters
-
end_effector | The arm's end-effector name. |
wrench | The wrench at the sensor point. |
- Returns
- false in case of error, true otherwise.
Definition at line 124 of file wrench_manager.cpp.
std::map<std::string, Eigen::Matrix<double, 6, 6> > generic_control_toolbox::WrenchManager::calibration_matrix_ |
|
private |
std::map<std::string, ros::Subscriber> generic_control_toolbox::WrenchManager::ft_sub_ |
|
private |
std::map<std::string, std::string> generic_control_toolbox::WrenchManager::gripping_frame_ |
|
private |
int generic_control_toolbox::WrenchManager::max_tf_attempts_ |
|
private |
std::map<std::string, KDL::Wrench> generic_control_toolbox::WrenchManager::measured_wrench_ |
|
private |
MatrixParser generic_control_toolbox::WrenchManager::parser_ |
|
private |
std::map<std::string, ros::Publisher> generic_control_toolbox::WrenchManager::processed_ft_pub_ |
|
private |
std::map<std::string, std::string> generic_control_toolbox::WrenchManager::sensor_frame_ |
|
private |
std::map<std::string, KDL::Frame> generic_control_toolbox::WrenchManager::sensor_to_gripping_point_ |
|
private |
The documentation for this class was generated from the following files: