Skip to content

Commit 467f7a8

Browse files
committed
Merge remote-tracking branch 'origin/master' into feature/joint_offset_param
2 parents 8a4f690 + f94adca commit 467f7a8

File tree

4 files changed

+20
-20
lines changed

4 files changed

+20
-20
lines changed

include/syropod_highlevel_controller/state_controller.h

Lines changed: 10 additions & 10 deletions
Original file line numberDiff line numberDiff line change
@@ -217,14 +217,14 @@ class StateController
217217
/// @param[in] input The Point geometry message provided by the topic "syropod_remote/secondary_tip_velocity"
218218
void secondaryTipVelocityInputCallback(const geometry_msgs::Point &input);
219219

220-
/// Callback for the input manual tip position (in cartesian space) for the AR leg (front right leg)
221-
/// @param[in] input The Pose geometry message provided by the subscribed topic "/syropod_manipulation/AR/Pose"
222-
/// @see (https://confluence.csiro.au/display/CPS/Weaver+Diagrams)
220+
/// Callback for the input manual tip pose (in cartesian space) for the primary selected leg.
221+
/// @param[in] input The Pose geometry message provided by the subscribed topic
222+
/// "/syropod_manipulation/primary_tip_pose"
223223
void primaryTipPoseInputCallback(const geometry_msgs::Pose &msg);
224224

225-
/// Callback for the input manual tip position (in cartesian space) for the AL leg (front left leg).
226-
/// @param[in] input The Pose geometry message provided by the subscribed topic "/syropod_manipulation/AL/Pose"
227-
/// @see (https://confluence.csiro.au/display/CPS/Weaver+Diagrams)
225+
/// Callback for the input manual tip pose (in cartesian space) for the secondary selected leg.
226+
/// @param[in] input The Pose geometry message provided by the subscribed topic
227+
/// "/syropod_manipulation/secondary_tip_pose"
228228
void secondaryTipPoseInputCallback(const geometry_msgs::Pose &msg);
229229

230230
/// Callback handling the desired parameter selection and sending state messages to user interface.
@@ -291,8 +291,8 @@ class StateController
291291
ros::Subscriber parameter_selection_subscriber_; ///< Subscriber for topic /syropod_remote/parameter_selection
292292
ros::Subscriber parameter_adjustment_subscriber_; ///< Subscriber for topic /syropod_remote/parameter_adjustment
293293

294-
ros::Subscriber primary_tip_pose_subscriber_; ///< Subscriber for topic /syropod_manipulation/AR/Pose
295-
ros::Subscriber secondary_tip_pose_subscriber_; ///< Subscriber for topic /syropod_manipulation/AL/Pose
294+
ros::Subscriber primary_tip_pose_subscriber_; ///< Subscriber for topic /syropod_manipulation/primary_tip_pose
295+
ros::Subscriber secondary_tip_pose_subscriber_; ///< Subscriber for topic /syropod_manipulation/secondary_tip_pose
296296

297297
ros::Subscriber target_configuration_subscriber_; ///< Subscriber for topic /target_configuration
298298
ros::Subscriber target_body_pose_subscriber_; ///< Subscriber for topic /target_body_pose
@@ -373,8 +373,8 @@ class StateController
373373
LegContainer::iterator leg_it_; ///< Leg iteration member variable used to minimise code
374374
JointContainer::iterator joint_it_; ///< Joint iteration member variable used to minimise code
375375

376-
Pose primary_pose_input_; ///< Input for the desired pose of the leg tip AR
377-
Pose secondary_pose_input_; ///< Input for the desired pose of the leg tip AR
376+
Pose primary_pose_input_; ///< Input for the desired pose of primary leg tip
377+
Pose secondary_pose_input_; ///< Input for the desired pose of secondary the leg tip
378378

379379
public:
380380
EIGEN_MAKE_ALIGNED_OPERATOR_NEW

readme.md

Lines changed: 6 additions & 6 deletions
Original file line numberDiff line numberDiff line change
@@ -98,14 +98,14 @@ For information on parameters see readme in config folder.
9898
* Type: std_msgs::Int8
9999

100100
### Syropod Manipulation:
101-
* AR Leg Tip Position:
102-
* Description: The desired position of leg AR in Cartesian space.
103-
* Topic: */syropod_manipulation/AR/Pose*
101+
* Primary Leg Tip Pose:
102+
* Description: The desired pose for the leg selected for primary manipulation within Cartesian space.
103+
* Topic: */syropod_manipulation/primary_tip_pose*
104104
* Type: geometry_msgs::Pose
105105

106-
* AL Leg Tip Position:
107-
* Description: The desired position of leg AL in Cartesian space.
108-
* Topic: */syropod_manipulation/AL/Pose*
106+
* Secondary Leg Tip Pose:
107+
* Description: The desired pose for the leg selected for secondary manipulation within Cartesian space.
108+
* Topic: */syropod_manipulation/secondary_tip_pose*
109109
* Type: geometry_msgs::Pose
110110

111111
### Motor and Sensor Inputs

src/state_controller.cpp

Lines changed: 3 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -63,10 +63,11 @@ StateController::StateController(void)
6363
&StateController::parameterSelectionCallback, this);
6464
parameter_adjustment_subscriber_ = n.subscribe("syropod_remote/parameter_adjustment", 1,
6565
&StateController::parameterAdjustCallback, this);
66+
6667
// Hexapod Leg Manipulation topic subscriptions
67-
primary_tip_pose_subscriber_ = n.subscribe("/syropod_manipulation/AR/Pose", 1,
68+
primary_tip_pose_subscriber_ = n.subscribe("/syropod_manipulation/primary_tip_pose", 1,
6869
&StateController::primaryTipPoseInputCallback, this);
69-
secondary_tip_pose_subscriber_ = n.subscribe("/syropod_manipulation/AL/Pose", 1,
70+
secondary_tip_pose_subscriber_ = n.subscribe("/syropod_manipulation/secondary_tip_pose", 1,
7071
&StateController::secondaryTipPoseInputCallback, this);
7172

7273
// Planner subscription/publisher

src/walk_controller.cpp

Lines changed: 1 addition & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -734,7 +734,6 @@ void WalkController::updateManual(const int &primary_leg_selection_ID, const Pos
734734
{
735735
if (params_.leg_manipulation_mode.data == "tip_control")
736736
{
737-
738737
// TODO add orientation control
739738
// leg_stepper->setCurrentTipPose(Pose(tip_position_input, tip_rotation_input));
740739
leg_stepper->setCurrentTipPose(Pose(tip_position_input, UNDEFINED_ROTATION));
@@ -1095,7 +1094,7 @@ void LegStepper::updateTipPosition(void)
10951094
target_tip_pose_.position_ += getProjection(difference, walk_plane_normal_);
10961095
}
10971096
// Shift target toward step surface by defined distance and rely on step surface contact detection (REACTIVE)
1098-
else
1097+
else
10991098
{
11001099
target_tip_pose_.position_ -= walker_->getStepDepth() * Eigen::Vector3d::UnitZ();
11011100
}

0 commit comments

Comments
 (0)