23 #ifndef UTILS_PUBLISHER_H_ 24 #define UTILS_PUBLISHER_H_ 27 #include <corbo-core/types.h> 32 #include <geometry_msgs/PoseStamped.h> 35 #include <std_msgs/ColorRGBA.h> 83 void publishLocalPlan(
const std::vector<geometry_msgs::PoseStamped>& local_plan)
const;
95 void publishGlobalPlan(
const std::vector<geometry_msgs::PoseStamped>& global_plan)
const;
107 const std::string& ns =
"RobotFootprintModel",
const std_msgs::ColorRGBA& color =
toColorMsg(0.5, 0.0, 0.8, 0.0));
124 void publishViaPoints(
const std::vector<teb_local_planner::PoseSE2>& via_points,
const std::string& ns =
"ViaPoints")
const;
134 static std_msgs::ColorRGBA
toColorMsg(
float a,
float r,
float g,
float b);
150 #endif // UTILS_PUBLISHER_H_
void publishObstacles(const teb_local_planner::ObstContainer &obstacles) const
Publish obstacle positions to the ros topic ../../mpc_markers.
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.
void publishLocalPlan(const std::vector< geometry_msgs::PoseStamped > &local_plan) const
Publish a given local plan to the ros topic ../../local_plan.
void publishRobotFootprintModel(const teb_local_planner::PoseSE2 ¤t_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.
void publishGlobalPlan(const std::vector< geometry_msgs::PoseStamped > &global_plan) const
Publish a given global plan to the ros topic ../../global_plan.
static std_msgs::ColorRGBA toColorMsg(float a, float r, float g, float b)
Helper function to generate a color message from single values.
Publisher()=default
Default constructor.
std::vector< Eigen::Vector2d, Eigen::aligned_allocator< Eigen::Vector2d > > Point2dContainer
ros::Publisher _local_plan_pub
std::shared_ptr< RobotDynamicsInterface > Ptr
RobotDynamicsInterface::Ptr _system
boost::shared_ptr< Obstacle > ObstaclePtr
void initialize(ros::NodeHandle &nh, RobotDynamicsInterface::Ptr system, const std::string &map_frame)
Initializes the class and registers topics.
teb_local_planner::ObstContainer ObstContainer
std::vector< ObstaclePtr > ObstContainer
ros::Publisher _mpc_marker_pub
This class provides publishing methods for common messages.
teb_local_planner::Point2dContainer Point2dContainer
ros::Publisher _global_plan_pub