test_mpc_optim_node.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 
23 #include <ros/ros.h>
24 
25 #include <Eigen/Core>
26 
31 
33 #include <visualization_msgs/Marker.h>
34 
35 #include <memory>
36 
37 namespace mpc = mpc_local_planner;
38 
40 {
41  public:
42  TestMpcOptimNode() = default;
43 
44  void start(ros::NodeHandle& nh);
45 
46  protected:
47  void CreateInteractiveMarker(const double& init_x, const double& init_y, unsigned int id, std::string frame,
49  void CB_obstacle_marker(const visualization_msgs::InteractiveMarkerFeedbackConstPtr& feedback);
50  void CB_customObstacle(const costmap_converter::ObstacleArrayMsg::ConstPtr& obst_msg);
51  void CB_clicked_points(const geometry_msgs::PointStampedConstPtr& point_msg);
52  void CB_via_points(const nav_msgs::Path::ConstPtr& via_points_msg);
53 
56  std::vector<teb_local_planner::PoseSE2> _via_points;
57 };
58 
60 {
61  std::string map_frame = "map";
62 
63  // interactive marker server for simulated dynamic obstacles
64  interactive_markers::InteractiveMarkerServer marker_server("marker_obstacles");
65 
66  // configure obstacles
67  _obstacles.push_back(boost::make_shared<teb_local_planner::PointObstacle>(-3, 1));
68  _obstacles.push_back(boost::make_shared<teb_local_planner::PointObstacle>(6, 2));
69  _obstacles.push_back(boost::make_shared<teb_local_planner::PointObstacle>(4, 0.1));
70 
71  // Add interactive markers
72  for (int i = 0; i < (int)_obstacles.size(); ++i)
73  {
74  // Add interactive markers for all point obstacles
76  if (pobst)
77  {
78  CreateInteractiveMarker(pobst->x(), pobst->y(), i, map_frame, &marker_server);
79  }
80  }
81  marker_server.applyChanges();
83 
84  // setup callback for custom obstacles
86 
87  // setup callback for clicked points (in rviz) that are considered as via-points
89 
90  // setup callback for via-points (callback overwrites previously set via-points)
92 
93  // Setup robot shape model
95 
97  if (!controller.configure(nh, _obstacles, robot_model, _via_points))
98  {
99  ROS_ERROR("Controller configuration failed.");
100  return;
101  }
102 
103  mpc::Publisher publisher(nh, controller.getRobotDynamics(), map_frame);
104 
105  teb_local_planner::PoseSE2 x0(0, 0, 0);
106  teb_local_planner::PoseSE2 xf(5, 2, 0);
107 
108  corbo::TimeSeries::Ptr x_seq = std::make_shared<corbo::TimeSeries>();
109  corbo::TimeSeries::Ptr u_seq = std::make_shared<corbo::TimeSeries>();
110 
111  geometry_msgs::Twist vel;
112 
113  bool success = false;
114 
115  ros::Rate rate(20);
116  while (ros::ok())
117  {
118  success = controller.step(x0, xf, vel, rate.expectedCycleTime().toSec(), ros::Time::now(), u_seq, x_seq);
119 
120  if (success)
121  publisher.publishLocalPlan(*x_seq);
122  else
123  ROS_ERROR("OCP solving failed.");
124 
125  publisher.publishObstacles(_obstacles);
126  publisher.publishRobotFootprintModel(x0, *robot_model);
127  publisher.publishViaPoints(_via_points);
128  ros::spinOnce();
129  rate.sleep();
130  }
131 }
132 
133 void TestMpcOptimNode::CreateInteractiveMarker(const double& init_x, const double& init_y, unsigned int id, std::string frame,
135 {
136  // create an interactive marker for our server
137  visualization_msgs::InteractiveMarker i_marker;
138  i_marker.header.frame_id = frame;
139  i_marker.header.stamp = ros::Time::now();
140  std::ostringstream oss;
141  // oss << "obstacle" << id;
142  oss << id;
143  i_marker.name = oss.str();
144  i_marker.description = "Obstacle";
145  i_marker.pose.position.x = init_x;
146  i_marker.pose.position.y = init_y;
147  i_marker.pose.orientation.w = 1.0f; // make quaternion normalized
148 
149  // create a grey box marker
150  visualization_msgs::Marker box_marker;
151  box_marker.type = visualization_msgs::Marker::CUBE;
152  box_marker.id = id;
153  box_marker.scale.x = 0.2;
154  box_marker.scale.y = 0.2;
155  box_marker.scale.z = 0.2;
156  box_marker.color.r = 0.5;
157  box_marker.color.g = 0.5;
158  box_marker.color.b = 0.5;
159  box_marker.color.a = 1.0;
160  box_marker.pose.orientation.w = 1.0f; // make quaternion normalized
161 
162  // create a non-interactive control which contains the box
163  visualization_msgs::InteractiveMarkerControl box_control;
164  box_control.always_visible = true;
165  box_control.markers.push_back(box_marker);
166 
167  // add the control to the interactive marker
168  i_marker.controls.push_back(box_control);
169 
170  // create a control which will move the box, rviz will insert 2 arrows
171  visualization_msgs::InteractiveMarkerControl move_control;
172  move_control.name = "move_x";
173  move_control.orientation.w = 0.707107f;
174  move_control.orientation.x = 0;
175  move_control.orientation.y = 0.707107f;
176  move_control.orientation.z = 0;
177  move_control.interaction_mode = visualization_msgs::InteractiveMarkerControl::MOVE_PLANE;
178 
179  // add the control to the interactive marker
180  i_marker.controls.push_back(move_control);
181 
182  // add the interactive marker to our collection
183  marker_server->insert(i_marker);
184  marker_server->setCallback(i_marker.name, boost::bind(&TestMpcOptimNode::CB_obstacle_marker, this, boost::placeholders::_1));
185 }
186 
187 void TestMpcOptimNode::CB_obstacle_marker(const visualization_msgs::InteractiveMarkerFeedbackConstPtr& feedback)
188 {
189  std::stringstream ss(feedback->marker_name);
190  unsigned int index;
191  ss >> index;
192 
193  if (index >= _no_fixed_obstacles) return;
194  teb_local_planner::PointObstacle* pobst = static_cast<teb_local_planner::PointObstacle*>(_obstacles.at(index).get());
195  pobst->position() = Eigen::Vector2d(feedback->pose.position.x, feedback->pose.position.y);
196 }
197 
198 void TestMpcOptimNode::CB_customObstacle(const costmap_converter::ObstacleArrayMsg::ConstPtr& obst_msg)
199 {
200  // resize such that the vector contains only the fixed obstacles specified inside the main function
202 
203  // Add custom obstacles obtained via message (assume that all obstacles coordiantes are specified in the default planning frame)
204  for (size_t i = 0; i < obst_msg->obstacles.size(); ++i)
205  {
206  if (obst_msg->obstacles.at(i).polygon.points.size() == 1)
207  {
208  if (obst_msg->obstacles.at(i).radius == 0)
209  {
211  obst_msg->obstacles.at(i).polygon.points.front().x, obst_msg->obstacles.at(i).polygon.points.front().y)));
212  }
213  else
214  {
216  new teb_local_planner::CircularObstacle(obst_msg->obstacles.at(i).polygon.points.front().x,
217  obst_msg->obstacles.at(i).polygon.points.front().y, obst_msg->obstacles.at(i).radius)));
218  }
219  }
220  else
221  {
223  for (size_t j = 0; j < obst_msg->obstacles.at(i).polygon.points.size(); ++j)
224  {
225  polyobst->pushBackVertex(obst_msg->obstacles.at(i).polygon.points[j].x, obst_msg->obstacles.at(i).polygon.points[j].y);
226  }
227  polyobst->finalizePolygon();
228  _obstacles.push_back(teb_local_planner::ObstaclePtr(polyobst));
229  }
230 
231  if (!_obstacles.empty()) _obstacles.back()->setCentroidVelocity(obst_msg->obstacles.at(i).velocities, obst_msg->obstacles.at(i).orientation);
232  }
233 }
234 
235 void TestMpcOptimNode::CB_clicked_points(const geometry_msgs::PointStampedConstPtr& point_msg)
236 {
237  // we assume for simplicity that the fixed frame is already the map/planning frame
238  // consider clicked points as via-points
239  _via_points.emplace_back(point_msg->point.x, point_msg->point.y, 0.0);
240  ROS_INFO_STREAM("Via-point (" << point_msg->point.x << "," << point_msg->point.y << ") added.");
241 }
242 
243 void TestMpcOptimNode::CB_via_points(const nav_msgs::Path::ConstPtr& via_points_msg)
244 {
245  ROS_INFO_ONCE("Via-points received. This message is printed once.");
246  _via_points.clear();
247  for (const geometry_msgs::PoseStamped& pose : via_points_msg->poses)
248  {
249  _via_points.emplace_back(pose.pose.position.x, pose.pose.position.y, 0);
250  }
251 }
252 
253 int main(int argc, char** argv)
254 {
255  ros::init(argc, argv, "test_optim_node");
256  ros::NodeHandle n("~");
257 
258  TestMpcOptimNode mpc_test;
259  mpc_test.start(n);
260 
261  return 0;
262 }
RobotDynamicsInterface::Ptr getRobotDynamics()
Definition: controller.h:75
return int(ret)+1
bool step(const PoseSE2 &start, const PoseSE2 &goal, const geometry_msgs::Twist &vel, double dt, ros::Time t, corbo::TimeSeries::Ptr u_seq, corbo::TimeSeries::Ptr x_seq)
Definition: controller.cpp:102
#define ROS_INFO_ONCE(...)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
ros::Subscriber custom_obst_sub
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
void CB_obstacle_marker(const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback)
void CreateInteractiveMarker(const double &init_x, const double &init_y, unsigned int id, std::string frame, interactive_markers::InteractiveMarkerServer *marker_server)
MPC controller for mobile robots.
Definition: controller.h:53
static RobotFootprintModelPtr getRobotFootprintFromParamServer(const ros::NodeHandle &nh, costmap_2d::Costmap2DROS *costmap_ros=nullptr)
Get the current robot footprint/contour model.
rate
void CB_via_points(const nav_msgs::Path::ConstPtr &via_points_msg)
void start(ros::NodeHandle &nh)
std::vector< ObstaclePtr > ObstContainer
ROSCPP_DECL bool ok()
void pushBackVertex(const Eigen::Ref< const Eigen::Vector2d > &vertex)
ros::Subscriber via_points_sub
bool sleep()
int main(int argc, char **argv)
void CB_customObstacle(const costmap_converter::ObstacleArrayMsg::ConstPtr &obst_msg)
INTERACTIVE_MARKERS_PUBLIC void insert(const visualization_msgs::InteractiveMarker &int_marker)
#define ROS_INFO_STREAM(args)
void CB_clicked_points(const geometry_msgs::PointStampedConstPtr &point_msg)
const Eigen::Vector2d & position() const
INTERACTIVE_MARKERS_PUBLIC void applyChanges()
This class provides publishing methods for common messages.
Definition: publisher.h:46
INTERACTIVE_MARKERS_PUBLIC bool setCallback(const std::string &name, FeedbackCallback feedback_cb, uint8_t feedback_type=DEFAULT_FEEDBACK_CB)
static Time now()
TestMpcOptimNode()=default
ros::Subscriber clicked_points_sub
std::vector< teb_local_planner::PoseSE2 > _via_points
teb_local_planner::ObstContainer _obstacles
std::shared_ptr< TimeSeries > Ptr
ROSCPP_DECL void spinOnce()
PlainMatrixType mat * n
#define ROS_ERROR(...)
bool configure(ros::NodeHandle &nh, const teb_local_planner::ObstContainer &obstacles, teb_local_planner::RobotFootprintModelPtr robot_model, const std::vector< teb_local_planner::PoseSE2 > &via_points)
Definition: controller.cpp:58
Duration expectedCycleTime() const


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