#include <wam_test.h>
Public Member Functions | |
void | mainLoop () |
WamTest () | |
Private Member Functions | |
void | calculate_error (std::string target) |
void | joint_states_callback (const sensor_msgs::JointState::ConstPtr &msg) |
void | pose_callback (const geometry_msgs::PoseStamped::ConstPtr &msg) |
Private Attributes | |
std::vector< double > | angles |
bool | gocenter |
ros::ServiceClient | joint_move_client |
iri_wam_common_msgs::joints_move | joint_move_srv |
ros::Subscriber | joint_states_subscriber |
tf::TransformListener | listener |
ros::NodeHandle | nh_ |
int | numtargets |
ros::ServiceClient | pose_move2_client |
iri_wam_common_msgs::pose_move | pose_move2_srv |
ros::ServiceClient | pose_move_client |
iri_wam_common_msgs::pose_move | pose_move_srv |
ros::Subscriber | pose_subscriber |
int | targetid |
ros::Publisher | tf_publisher |
tf::tfMessage | tfMessage_msg |
std::vector< Eigen::Matrix4f, Eigen::aligned_allocator < Eigen::Matrix4f > > | transforms |
Definition at line 26 of file wam_test.h.
WamTest::WamTest | ( | ) |
Definition at line 5 of file wam_test.cpp.
void WamTest::calculate_error | ( | std::string | target | ) | [private] |
Definition at line 227 of file wam_test.cpp.
void WamTest::joint_states_callback | ( | const sensor_msgs::JointState::ConstPtr & | msg | ) | [private] |
Definition at line 214 of file wam_test.cpp.
void WamTest::mainLoop | ( | void | ) |
--> y = x, z = y, w = z i x = w.
Definition at line 49 of file wam_test.cpp.
void WamTest::pose_callback | ( | const geometry_msgs::PoseStamped::ConstPtr & | msg | ) | [private] |
Definition at line 209 of file wam_test.cpp.
std::vector<double> WamTest::angles [private] |
Definition at line 36 of file wam_test.h.
bool WamTest::gocenter [private] |
Definition at line 33 of file wam_test.h.
ros::ServiceClient WamTest::joint_move_client [private] |
Definition at line 53 of file wam_test.h.
iri_wam_common_msgs::joints_move WamTest::joint_move_srv [private] |
Definition at line 54 of file wam_test.h.
Definition at line 44 of file wam_test.h.
tf::TransformListener WamTest::listener [private] |
Definition at line 39 of file wam_test.h.
ros::NodeHandle WamTest::nh_ [private] |
Definition at line 37 of file wam_test.h.
int WamTest::numtargets [private] |
Definition at line 34 of file wam_test.h.
ros::ServiceClient WamTest::pose_move2_client [private] |
Definition at line 49 of file wam_test.h.
iri_wam_common_msgs::pose_move WamTest::pose_move2_srv [private] |
Definition at line 50 of file wam_test.h.
ros::ServiceClient WamTest::pose_move_client [private] |
Definition at line 51 of file wam_test.h.
iri_wam_common_msgs::pose_move WamTest::pose_move_srv [private] |
Definition at line 52 of file wam_test.h.
ros::Subscriber WamTest::pose_subscriber [private] |
Definition at line 46 of file wam_test.h.
int WamTest::targetid [private] |
Definition at line 35 of file wam_test.h.
ros::Publisher WamTest::tf_publisher [private] |
Definition at line 38 of file wam_test.h.
tf::tfMessage WamTest::tfMessage_msg [private] |
Definition at line 40 of file wam_test.h.
std::vector<Eigen::Matrix4f,Eigen::aligned_allocator<Eigen::Matrix4f> > WamTest::transforms [private] |
Definition at line 42 of file wam_test.h.