odom_plugin.cpp
Go to the documentation of this file.
1 /*
2  * Copyright 2017 Fraunhofer Institute for Manufacturing Engineering and Automation (IPA)
3  *
4  * Licensed under the Apache License, Version 2.0 (the "License");
5  * you may not use this file except in compliance with the License.
6  * You may obtain a copy of the License at
7  *
8  * http://www.apache.org/licenses/LICENSE-2.0
9 
10  * Unless required by applicable law or agreed to in writing, software
11  * distributed under the License is distributed on an "AS IS" BASIS,
12  * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
13  * See the License for the specific language governing permissions and
14  * limitations under the License.
15  */
16 
17 
19 
21 
23 
26 
27 #include <std_srvs/Trigger.h>
28 
29 #include "GeomController.h"
30 
32 {
33 
34 // this controller gets access to the JointStateInterface
35 class OdometryController: public GeomController<hardware_interface::JointStateInterface, UndercarriageGeom>
36 {
37 public:
39 
40  virtual bool init(hardware_interface::JointStateInterface* hw, ros::NodeHandle &root_nh, ros::NodeHandle& controller_nh){
41 
42  if(!GeomController::init(hw, controller_nh)) return false;
43 
44  double publish_rate;
45  if (!controller_nh.getParam("publish_rate", publish_rate)){
46  ROS_ERROR("Parameter 'publish_rate' not set");
47  return false;
48  }
49  if(publish_rate <= 0){
50  ROS_ERROR_STREAM("publish_rate must be positive.");
51  return false;
52  }
53 
54  frame_id_ = controller_nh.param("frame_id", std::string("odom"));
55  child_frame_id_ = controller_nh.param("child_frame_id", std::string("base_footprint"));
56  const double cov_pose = controller_nh.param("cov_pose", 0.1);
57  const double cov_twist = controller_nh.param("cov_twist", 0.1);
58 
59  odom_tracker_.reset(new OdometryTracker(frame_id_, child_frame_id_, cov_pose, cov_twist));
60  odom_ = odom_tracker_->getOdometry();
61 
62  topic_pub_odometry_ = controller_nh.advertise<nav_msgs::Odometry>("odometry", 1);
63 
64  bool broadcast_tf = true;
65  controller_nh.getParam("broadcast_tf", broadcast_tf);
66 
67  if(broadcast_tf){
68  odom_tf_.header.frame_id = frame_id_;
69  odom_tf_.child_frame_id = child_frame_id_;
71  }
72 
73  controller_nh.getParam("invert_odom_tf", invert_odom_tf_);
74 
75  publish_timer_ = controller_nh.createTimer(ros::Duration(1 / publish_rate), &OdometryController::publish, this);
76  service_reset_ = controller_nh.advertiseService("reset_odometry", &OdometryController::srv_reset, this);
77 
78  return true;
79  }
80  virtual void starting(const ros::Time& time){
81  if(time != stop_time_) odom_tracker_->init(time); // do not init odometry on restart
82  reset_ = false;
83  }
84 
85  virtual bool srv_reset(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)
86  {
87  if(!isRunning()){
88  res.message = "not running";
89  res.success = false;
90  }else{
91  boost::mutex::scoped_lock lock(mutex_);
92  reset_ = true;
93  lock.unlock();
94  res.success = true;
95  ROS_INFO("Resetting odometry to zero.");
96  }
97 
98  return true;
99  }
100 
101  virtual void update(const ros::Time& time, const ros::Duration& period){
102 
103  updateState();
104 
105  geom_->calcDirect(platform_state_);
106 
108 
109  boost::mutex::scoped_try_lock lock(mutex_);
110  if(lock){
111  if(reset_){
112  odom_tracker_->init(time);
113  reset_ = false;
114  }
115  odom_ = odom_tracker_->getOdometry();
116  }
117 
118  }
119  virtual void stopping(const ros::Time& time) { stop_time_ = time; }
120 
121 private:
123 
124  ros::Publisher topic_pub_odometry_; // calculated (measured) velocity, rotation and pose (odometry-based) for the robot
125  ros::ServiceServer service_reset_; // service to reset odometry to zero
126 
127  boost::scoped_ptr<tf::TransformBroadcaster> tf_broadcast_odometry_; // according transformation for the tf broadcaster
128  boost::scoped_ptr<OdometryTracker> odom_tracker_;
130  nav_msgs::Odometry odom_;
131  bool reset_;
132  bool invert_odom_tf_ = false;
133  boost::mutex mutex_;
135  geometry_msgs::TransformStamped odom_tf_;
137 
138 
139  void publish(const ros::TimerEvent& event){
140  if(!isRunning()) return;
141 
142  boost::mutex::scoped_lock lock(mutex_);
143 
144  topic_pub_odometry_.publish(odom_);
145 
146  if(tf_broadcast_odometry_){
147  // check prevents TF_REPEATED_DATA warning
148  if (odom_tf_.header.stamp == odom_.header.stamp){
149  // ROS_WARN_STREAM("OdometryController: already published odom_tf before");
150  // ROS_WARN_STREAM("\todom_tf: " << odom_tf_);
151  // ROS_WARN_STREAM("\todom_: " << odom_);
152  // ROS_WARN_STREAM("\tevent.last_expected: " << event.last_expected);
153  // ROS_WARN_STREAM("\tevent.last_real: " << event.last_real);
154  // ROS_WARN_STREAM("\tevent.current_expected: " << event.current_expected);
155  // ROS_WARN_STREAM("\tevent.current_real: " << event.current_real);
156  } else {
157  // compose and publish transform for tf package
158  // compose header
159  odom_tf_.header.stamp = odom_.header.stamp;
160  // compose data container
161  odom_tf_.transform.translation.x = odom_.pose.pose.position.x;
162  odom_tf_.transform.translation.y = odom_.pose.pose.position.y;
163  odom_tf_.transform.rotation = odom_.pose.pose.orientation;
164  if (invert_odom_tf_){
165  odom_tf_.header.frame_id = child_frame_id_;
166  odom_tf_.child_frame_id = frame_id_;
167  tf::Transform transform;
168  tf::transformMsgToTF(odom_tf_.transform, transform);
169  tf::transformTFToMsg(transform.inverse(), odom_tf_.transform);
170  }
171  // publish the transform (for debugging, conflicts with robot-pose-ekf)
172  tf_broadcast_odometry_->sendTransform(odom_tf_);
173  }
174  }
175  }
176 };
177 
178 }
179 
void publish(const ros::TimerEvent &event)
virtual void starting(const ros::Time &time)
Definition: odom_plugin.cpp:80
const double getVelY()
Transform inverse() const
virtual void update(const ros::Time &time, const ros::Duration &period)
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
geometry_msgs::TransformStamped odom_tf_
virtual bool init(hardware_interface::JointStateInterface *hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)
Definition: odom_plugin.cpp:40
ServiceServer advertiseService(const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj)
virtual void stopping(const ros::Time &time)
boost::scoped_ptr< tf::TransformBroadcaster > tf_broadcast_odometry_
bool param(const std::string &param_name, T &param_val, const T &default_val) const
void publish(const boost::shared_ptr< M > &message) const
#define ROS_INFO(...)
bool getParam(const std::string &key, std::string &s) const
const double getVelX()
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
virtual bool srv_reset(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)
Definition: odom_plugin.cpp:85
bool init(Interface *hw, ros::NodeHandle &controller_nh)
boost::scoped_ptr< OdometryTracker > odom_tracker_
static void transformMsgToTF(const geometry_msgs::Transform &msg, Transform &bt)
#define ROS_ERROR_STREAM(args)
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
#define ROS_ERROR(...)
static void transformTFToMsg(const Transform &bt, geometry_msgs::Transform &msg)


cob_omni_drive_controller
Author(s): Christian Connette, Mathias Lüdtke
autogenerated on Mon May 1 2023 02:50:23