armadillo_teleop.cpp
Go to the documentation of this file.
2 
3 
5 {
6  nh_ = &nh;
7  twist_pub_ = nh_->advertise<geometry_msgs::Twist>("cmd_vel", 5);
8  torso_pub_ = nh_->advertise<std_msgs::Float64>("torso_effort_controller/command", 5);
9 }
10 
12 {
13  geometry_msgs::Twist twist_msg;
14  twist_msg.angular.z = twist.axis_angular * twist.scale_angular;
15  twist_msg.linear.x = twist.axis_linear * twist.scale_linear;
16  twist_pub_.publish(twist_msg);
17 }
18 
20 {
21  std_msgs::Float64 torso_pos;
22  torso_pos.data = torso.axis_updown + torso.inc_updown;
23  torso_pub_.publish(torso_pos);
24 }
float scale_linear
Armadillo2Teleop(ros::NodeHandle &nh)
void publish(const boost::shared_ptr< M > &message) const
float inc_updown
float axis_updown
float axis_linear
ros::NodeHandle * nh_
ros::Publisher twist_pub_
ros::Publisher torso_pub_
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
float axis_angular
float scale_angular


armadillo2_teleop
Author(s):
autogenerated on Wed Jan 3 2018 03:47:53