publisher.cpp
Go to the documentation of this file.
1 /*********************************************************************
2  *
3  * Software License Agreement
4  *
5  * Copyright (c) 2020, Christoph Rösmann, All rights reserved.
6  *
7  * This program is free software: you can redistribute it and/or modify
8  * it under the terms of the GNU General Public License as published by
9  * the Free Software Foundation, either version 3 of the License, or
10  * (at your option) any later version.
11  *
12  * This program is distributed in the hope that it will be useful,
13  * but WITHOUT ANY WARRANTY; without even the implied warranty of
14  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
15  * GNU General Public License for more details.
16  *
17  * You should have received a copy of the GNU General Public License
18  * along with this program. If not, see <https://www.gnu.org/licenses/>.
19  *
20  * Authors: Christoph Rösmann
21  *********************************************************************/
22 
24 
26 
28 #include <nav_msgs/Path.h>
29 #include <ros/console.h>
30 #include <visualization_msgs/Marker.h>
31 
32 #include <boost/pointer_cast.hpp>
33 #include <boost/shared_ptr.hpp>
34 
35 #include <cmath>
36 #include <iomanip>
37 #include <memory>
38 
39 namespace mpc_local_planner {
40 
41 Publisher::Publisher(ros::NodeHandle& nh, RobotDynamicsInterface::Ptr system, const std::string& map_frame) { initialize(nh, system, map_frame); }
42 
43 void Publisher::initialize(ros::NodeHandle& nh, RobotDynamicsInterface::Ptr system, const std::string& map_frame)
44 {
45  if (_initialized) ROS_WARN("mpc_local_planner: Publisher already initialized. Reinitalizing...");
46 
47  _system = system;
48  _map_frame = map_frame;
49 
50  // register topics
51  _global_plan_pub = nh.advertise<nav_msgs::Path>("global_plan", 1);
52  _local_plan_pub = nh.advertise<nav_msgs::Path>("local_plan", 1);
53  _mpc_marker_pub = nh.advertise<visualization_msgs::Marker>("mpc_markers", 1000);
54 
55  _initialized = true;
56 }
57 
58 void Publisher::publishLocalPlan(const std::vector<geometry_msgs::PoseStamped>& local_plan) const
59 {
60  if (!_initialized) return;
62 }
63 
65 {
66  if (!_initialized) return;
67  if (!_system)
68  {
69  ROS_ERROR("Publisher::publishLocalPlan(): cannot publish since the system class is not provided.");
70  return;
71  }
72 
73  std::vector<geometry_msgs::PoseStamped> local_plan;
74  convert(ts, *_system, local_plan, _map_frame);
76 }
77 
78 void Publisher::publishGlobalPlan(const std::vector<geometry_msgs::PoseStamped>& global_plan) const
79 {
80  if (!_initialized) return;
82 }
83 
85  const teb_local_planner::BaseRobotFootprintModel& robot_model, const std::string& ns,
86  const std_msgs::ColorRGBA& color)
87 {
88  if (!_initialized) return;
89 
90  std::vector<visualization_msgs::Marker> markers;
91  robot_model.visualizeRobot(current_pose, markers, color);
92  if (markers.empty()) return;
93 
94  int idx = 1000000; // avoid overshadowing by obstacles
95  for (visualization_msgs::Marker& marker : markers)
96  {
97  marker.header.frame_id = _map_frame;
98  marker.header.stamp = ros::Time::now();
99  marker.action = visualization_msgs::Marker::ADD;
100  marker.ns = ns;
101  marker.id = idx++;
102  marker.lifetime = ros::Duration(2.0);
103  _mpc_marker_pub.publish(marker);
104  }
105 }
106 
108 {
109  if (obstacles.empty() || !_initialized) return;
110 
111  // Visualize point obstacles
112  {
113  visualization_msgs::Marker marker;
114  marker.header.frame_id = _map_frame;
115  marker.header.stamp = ros::Time::now();
116  marker.ns = "PointObstacles";
117  marker.id = 0;
118  marker.type = visualization_msgs::Marker::POINTS;
119  marker.action = visualization_msgs::Marker::ADD;
120  marker.lifetime = ros::Duration(2.0);
121 
122  for (const ObstaclePtr& obst : obstacles)
123  {
124  // std::shared_ptr<PointObstacle> pobst = std::dynamic_pointer_cast<PointObstacle>(obst); // TODO(roesmann): change teb_local_planner
125  // types to std lib
126  boost::shared_ptr<PointObstacle> pobst = boost::dynamic_pointer_cast<PointObstacle>(obst);
127  if (!pobst) continue;
128 
129  geometry_msgs::Point point;
130  point.x = pobst->x();
131  point.y = pobst->y();
132  point.z = 0;
133  marker.points.push_back(point);
134  }
135 
136  marker.scale.x = 0.1;
137  marker.scale.y = 0.1;
138  marker.color.a = 1.0;
139  marker.color.r = 1.0;
140  marker.color.g = 0.0;
141  marker.color.b = 0.0;
142 
143  _mpc_marker_pub.publish(marker);
144  }
145 
146  // Visualize line obstacles
147  {
148  int idx = 0;
149  for (const ObstaclePtr& obst : obstacles)
150  {
151  // LineObstacle::Ptr pobst = std::dynamic_pointer_cast<LineObstacle>(obst);
152  boost::shared_ptr<LineObstacle> pobst = boost::dynamic_pointer_cast<LineObstacle>(obst);
153  if (!pobst) continue;
154 
155  visualization_msgs::Marker marker;
156  marker.header.frame_id = _map_frame;
157  marker.header.stamp = ros::Time::now();
158  marker.ns = "LineObstacles";
159  marker.id = idx++;
160  marker.type = visualization_msgs::Marker::LINE_STRIP;
161  marker.action = visualization_msgs::Marker::ADD;
162  marker.lifetime = ros::Duration(2.0);
163  geometry_msgs::Point start;
164  start.x = pobst->start().x();
165  start.y = pobst->start().y();
166  start.z = 0;
167  marker.points.push_back(start);
168  geometry_msgs::Point end;
169  end.x = pobst->end().x();
170  end.y = pobst->end().y();
171  end.z = 0;
172  marker.points.push_back(end);
173 
174  marker.scale.x = 0.1;
175  marker.scale.y = 0.1;
176  marker.color.a = 1.0;
177  marker.color.r = 0.0;
178  marker.color.g = 1.0;
179  marker.color.b = 0.0;
180 
181  _mpc_marker_pub.publish(marker);
182  }
183  }
184 
185  // Visualize polygon obstacles
186  {
187  int idx = 0;
188  for (const ObstaclePtr& obst : obstacles)
189  {
190  // PolygonObstacle::Ptr pobst = std::dynamic_pointer_cast<PolygonObstacle>(obst);
191  boost::shared_ptr<PolygonObstacle> pobst = boost::dynamic_pointer_cast<PolygonObstacle>(obst);
192  if (!pobst) continue;
193 
194  visualization_msgs::Marker marker;
195  marker.header.frame_id = _map_frame;
196  marker.header.stamp = ros::Time::now();
197  marker.ns = "PolyObstacles";
198  marker.id = idx++;
199  marker.type = visualization_msgs::Marker::LINE_STRIP;
200  marker.action = visualization_msgs::Marker::ADD;
201  marker.lifetime = ros::Duration(2.0);
202 
203  for (Point2dContainer::const_iterator vertex = pobst->vertices().begin(); vertex != pobst->vertices().end(); ++vertex)
204  {
205  geometry_msgs::Point point;
206  point.x = vertex->x();
207  point.y = vertex->y();
208  point.z = 0;
209  marker.points.push_back(point);
210  }
211 
212  // Also add last point to close the polygon
213  // but only if polygon has more than 2 points (it is not a line)
214  if (pobst->vertices().size() > 2)
215  {
216  geometry_msgs::Point point;
217  point.x = pobst->vertices().front().x();
218  point.y = pobst->vertices().front().y();
219  point.z = 0;
220  marker.points.push_back(point);
221  }
222  marker.scale.x = 0.1;
223  marker.scale.y = 0.1;
224  marker.color.a = 1.0;
225  marker.color.r = 1.0;
226  marker.color.g = 0.0;
227  marker.color.b = 0.0;
228 
229  _mpc_marker_pub.publish(marker);
230  }
231  }
232 }
233 
234 void Publisher::publishViaPoints(const std::vector<teb_local_planner::PoseSE2>& via_points, const std::string& ns) const
235 {
236  if (via_points.empty() || !_initialized) return;
237 
238  visualization_msgs::Marker marker;
239  marker.header.frame_id = _map_frame;
240  marker.header.stamp = ros::Time::now();
241  marker.ns = ns;
242  marker.id = 55555;
243  marker.type = visualization_msgs::Marker::POINTS;
244  marker.action = visualization_msgs::Marker::ADD;
245  marker.lifetime = ros::Duration(2.0);
246 
247  for (const teb_local_planner::PoseSE2& via_point : via_points)
248  {
249  geometry_msgs::Point point;
250  point.x = via_point.x();
251  point.y = via_point.y();
252  point.z = 0;
253  marker.points.push_back(point);
254  }
255 
256  marker.scale.x = 0.1;
257  marker.scale.y = 0.1;
258  marker.color.a = 1.0;
259  marker.color.r = 0.0;
260  marker.color.g = 0.0;
261  marker.color.b = 1.0;
262 
263  _mpc_marker_pub.publish(marker);
264 }
265 
266 std_msgs::ColorRGBA Publisher::toColorMsg(float a, float r, float g, float b)
267 {
268  std_msgs::ColorRGBA color;
269  color.a = a;
270  color.r = r;
271  color.g = g;
272  color.b = b;
273  return color;
274 }
275 
276 } // namespace mpc_local_planner
void publishObstacles(const teb_local_planner::ObstContainer &obstacles) const
Publish obstacle positions to the ros topic ../../mpc_markers.
Definition: publisher.cpp:107
list point
void publishViaPoints(const std::vector< teb_local_planner::PoseSE2 > &via_points, const std::string &ns="ViaPoints") const
Publish via-points to the ros topic ../../teb_markers.
Definition: publisher.cpp:234
ROSCPP_DECL void start()
void publishLocalPlan(const std::vector< geometry_msgs::PoseStamped > &local_plan) const
Publish a given local plan to the ros topic ../../local_plan.
Definition: publisher.cpp:58
void publishRobotFootprintModel(const teb_local_planner::PoseSE2 &current_pose, const teb_local_planner::BaseRobotFootprintModel &robot_model, const std::string &ns="RobotFootprintModel", const std_msgs::ColorRGBA &color=toColorMsg(0.5, 0.0, 0.8, 0.0))
Publish the visualization of the robot model.
Definition: publisher.cpp:84
void convert(const corbo::TimeSeries &time_series, const RobotDynamicsInterface &dynamics, std::vector< geometry_msgs::PoseStamped > &poses_stamped, const std::string &frame_id)
Convert TimeSeries to pose array.
Definition: conversion.cpp:29
void publishGlobalPlan(const std::vector< geometry_msgs::PoseStamped > &global_plan) const
Publish a given global plan to the ros topic ../../global_plan.
Definition: publisher.cpp:78
static std_msgs::ColorRGBA toColorMsg(float a, float r, float g, float b)
Helper function to generate a color message from single values.
Definition: publisher.cpp:266
Publisher()=default
Default constructor.
#define ROS_WARN(...)
ros::Publisher _local_plan_pub
Definition: publisher.h:143
std::shared_ptr< RobotDynamicsInterface > Ptr
RobotDynamicsInterface::Ptr _system
Definition: publisher.h:141
void initialize(ros::NodeHandle &nh, RobotDynamicsInterface::Ptr system, const std::string &map_frame)
Initializes the class and registers topics.
Definition: publisher.cpp:43
void publish(const boost::shared_ptr< M > &message) const
std::vector< ObstaclePtr > ObstContainer
ros::Publisher _mpc_marker_pub
Definition: publisher.h:145
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void publishPlan(const std::vector< geometry_msgs::PoseStamped > &path, const ros::Publisher &pub)
virtual void visualizeRobot(const PoseSE2 &current_pose, std::vector< visualization_msgs::Marker > &markers, const std_msgs::ColorRGBA &color) const
static Time now()
#define ROS_ERROR(...)
ros::Publisher _global_plan_pub
Definition: publisher.h:144


mpc_local_planner
Author(s): Christoph Rösmann
autogenerated on Mon Feb 28 2022 22:53:18