 |
Multi-robot Playground
|
Go to the documentation of this file.
54 #include "std_msgs/Float64MultiArray.h"
55 #include "geometry_msgs/Pose.h"
56 #include "geometry_msgs/PoseArray.h"
57 #include "std_msgs/Int8MultiArray.h"
58 #include "visualization_msgs/Marker.h"
59 #include "visualization_msgs/MarkerArray.h"
60 #include "multirobotsimulations/CustomPose.h"
61 #include "multirobotsimulations/MockPackage.h"
75 void PrepareMarkers(visualization_msgs::Marker& input,
const char* ns,
const int&
id,
const int& seq);
76 void SetNear(visualization_msgs::Marker& input);
77 void SetFar(visualization_msgs::Marker& input);
78 void CommCallback(std_msgs::Int8MultiArray::ConstPtr msg);
int aQueueSize
Definition: RelativePoseEstimatorNode.h:86
void LoadRelativePoses(ros::NodeHandle &nodeHandle)
ros::Publisher aFarMarkerPublisher
Definition: RelativePoseEstimatorNode.h:108
void PrepareMarkers(visualization_msgs::Marker &input, const char *ns, const int &id, const int &seq)
visualization_msgs::Marker aClusterMarkerMsg
Definition: RelativePoseEstimatorNode.h:115
visualization_msgs::Marker aClusterMarkerFarMsg
Definition: RelativePoseEstimatorNode.h:116
std::vector< bool > aReceivedPoses
Definition: RelativePoseEstimatorNode.h:124
double aRate
Definition: RelativePoseEstimatorNode.h:88
ros::Publisher aNearMarkerPublisher
Definition: RelativePoseEstimatorNode.h:107
std::string aNamespace
Definition: RelativePoseEstimatorNode.h:89
void SetNear(visualization_msgs::Marker &input)
std_msgs::Int8MultiArray aRobotsInCommMsg
Definition: RelativePoseEstimatorNode.h:118
RelativePoseEstimatorNode()
ros::Publisher aRelativePosesPublisher
Definition: RelativePoseEstimatorNode.h:105
ros::Publisher aDistancesPublisher
Definition: RelativePoseEstimatorNode.h:106
std::vector< geometry_msgs::Pose > aRobotsWorldPoses
Definition: RelativePoseEstimatorNode.h:123
std_msgs::Float64MultiArray aRobotsRelativeDistancesMsg
Definition: RelativePoseEstimatorNode.h:117
~RelativePoseEstimatorNode()
std::vector< ros::Timer > aTimers
Definition: RelativePoseEstimatorNode.h:94
void CommCallback(std_msgs::Int8MultiArray::ConstPtr msg)
int aId
Definition: RelativePoseEstimatorNode.h:85
ros::Publisher aStartRelativePosesPublisher
Definition: RelativePoseEstimatorNode.h:104
void SetFar(visualization_msgs::Marker &input)
geometry_msgs::PoseArray aRobotsRelStartingPosMsg
Definition: RelativePoseEstimatorNode.h:113
geometry_msgs::PoseArray aRobotsRelativePosesMsg
Definition: RelativePoseEstimatorNode.h:114
std::vector< ros::Subscriber > aSubscribers
Definition: RelativePoseEstimatorNode.h:99
int aSeq
Definition: RelativePoseEstimatorNode.h:87
Definition: RelativePoseEstimatorNode.h:68
std::vector< tf::Vector3 > aRelativePoses
Definition: RelativePoseEstimatorNode.h:125
int aRobots
Definition: RelativePoseEstimatorNode.h:84