Skip to content
Snippets Groups Projects
Commit c1b7b67f authored by Johannes Mey's avatar Johannes Mey
Browse files

align config with ros2rag

parent d15284a8
Branches
No related tags found
No related merge requests found
...@@ -6,7 +6,8 @@ panda_mqtt_connector: ...@@ -6,7 +6,8 @@ panda_mqtt_connector:
topics: topics:
robotConfig: "robotconfig" robotConfig: "robotconfig"
dataConfig: "dataconfig" dataConfig: "dataconfig"
trajectoryConfig: "trajectoryconfig" trajectory: "trajectory"
nextStep: "ros2rag/nextStep"
zone_size: 0.5 zone_size: 0.5
zones: zones:
- "1 1" - "1 1"
...@@ -25,3 +26,10 @@ panda_mqtt_connector: ...@@ -25,3 +26,10 @@ panda_mqtt_connector:
end_effectors: end_effectors:
panda: panda:
EndEffector: "panda::panda_link7" EndEffector: "panda::panda_link7"
goal_poses:
- position: "0.4 0.3 0.1"
wait: "5000"
- position: "0.4 0.0 0.1"
wait: "3000"
- position: "0.4 -0.3 0.1"
wait: "4000"
...@@ -37,7 +37,7 @@ void testTrajectoryUpdate(const ros::NodeHandle& n) { ...@@ -37,7 +37,7 @@ void testTrajectoryUpdate(const ros::NodeHandle& n) {
std::string mqtt_msg; std::string mqtt_msg;
traj.SerializeToString(&mqtt_msg); traj.SerializeToString(&mqtt_msg);
auto pubmsg = mqtt::make_message("trajectoryconfig", mqtt_msg); auto pubmsg = mqtt::make_message("trajectory", mqtt_msg);
mqttUtil->getClient().publish(pubmsg); mqttUtil->getClient().publish(pubmsg);
......
...@@ -13,7 +13,7 @@ const std::string CLIENT_ID{"mqtt_to_ros"}; ...@@ -13,7 +13,7 @@ const std::string CLIENT_ID{"mqtt_to_ros"};
const std::string ROBOT_CONFIG{"robotconfig"}; const std::string ROBOT_CONFIG{"robotconfig"};
const std::string DATA_CONFIG{"dataconfig"}; const std::string DATA_CONFIG{"dataconfig"};
const std::string TRAJECTORY_CONFIG{"trajectoryconfig"}; const std::string TRAJECTORY_CONFIG{"trajectory"};
MqttUtil *mqttUtil = nullptr; MqttUtil *mqttUtil = nullptr;
......
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Please register or to comment