Skip to content

Commit

Permalink
Fix spelling (#48)
Browse files Browse the repository at this point in the history
Signed-off-by: Sarathkrishnan Ramesh <sarathkrishnan99@gmail.com>
  • Loading branch information
Sarath18 committed Aug 17, 2020
1 parent 0983bfa commit 6ba22fa
Show file tree
Hide file tree
Showing 3 changed files with 12 additions and 12 deletions.
Expand Up @@ -167,20 +167,20 @@ class PoseDisplay : public MessageDisplay<geometry_msgs::msg::PoseStamped>
Q_INVOKABLE void setAxisHeadVisibility(const bool & _visible);

/**
* @brief Set axis length
* @brief Set axis dimensions
* @param _length Axis length
* @param _radius Axis radius
*/
Q_INVOKABLE void setAxisDimentions(const float & _length, const float & _radius);
Q_INVOKABLE void setAxisDimensions(const float & _length, const float & _radius);

/**
* @brief Set arrow dimentions
* @brief Set arrow dimensions
* @param _shaftLength Arrow shaft length
* @param _shaftRadius Arrow shaft radius
* @param _headLength Arrow head length
* @param _headRadius Arrow head radius
*/
Q_INVOKABLE void setArrowDimentions(
Q_INVOKABLE void setArrowDimensions(
const float & _shaftLength, const float & _shaftRadius,
const float & _headLength, const float & _headRadius);

Expand Down
12 changes: 6 additions & 6 deletions ign_rviz_plugins/res/qml/PoseDisplay.qml
Expand Up @@ -192,7 +192,7 @@ Item {
regExp: /^([0-9]*\.[0-9]+|[0-9]+)$/g
}
onAccepted: {
PoseDisplay.setArrowDimentions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
PoseDisplay.setArrowDimensions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
}
}
}
Expand All @@ -218,7 +218,7 @@ Item {
regExp: /^([0-9]*\.[0-9]+|[0-9]+)$/g
}
onAccepted: {
PoseDisplay.setArrowDimentions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
PoseDisplay.setArrowDimensions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
}
}
}
Expand All @@ -244,7 +244,7 @@ Item {
regExp: /^([0-9]*\.[0-9]+|[0-9]+)$/g
}
onAccepted: {
PoseDisplay.setArrowDimentions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
PoseDisplay.setArrowDimensions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
}
}
}
Expand All @@ -270,7 +270,7 @@ Item {
regExp: /^([0-9]*\.[0-9]+|[0-9]+)$/g
}
onAccepted: {
PoseDisplay.setArrowDimentions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
PoseDisplay.setArrowDimensions(shaftLength.text, shaftRadius.text, headLength.text, headRadius.text)
}
}
}
Expand Down Expand Up @@ -303,7 +303,7 @@ Item {
regExp: /^([0-9]*\.[0-9]+|[0-9]+)$/g
}
onAccepted: {
PoseDisplay.setAxisDimentions(axisLengthField.text, axisRadiusField.text)
PoseDisplay.setAxisDimensions(axisLengthField.text, axisRadiusField.text)
}
}
}
Expand All @@ -329,7 +329,7 @@ Item {
regExp: /^([0-9]*\.[0-9]+|[0-9]+)$/g
}
onAccepted: {
PoseDisplay.setAxisDimentions(axisLengthField.text, axisRadiusField.text)
PoseDisplay.setAxisDimensions(axisLengthField.text, axisRadiusField.text)
}
}
}
Expand Down
4 changes: 2 additions & 2 deletions ign_rviz_plugins/src/rviz/plugins/PoseDisplay.cpp
Expand Up @@ -199,7 +199,7 @@ void PoseDisplay::setAxisHeadVisibility(const bool & _visible)
}

////////////////////////////////////////////////////////////////////////////////
void PoseDisplay::setAxisDimentions(const float & _length, const float & _radius)
void PoseDisplay::setAxisDimensions(const float & _length, const float & _radius)
{
std::lock_guard<std::mutex>(this->lock);
this->axis.length = _length;
Expand All @@ -208,7 +208,7 @@ void PoseDisplay::setAxisDimentions(const float & _length, const float & _radius
}

////////////////////////////////////////////////////////////////////////////////
void PoseDisplay::setArrowDimentions(
void PoseDisplay::setArrowDimensions(
const float & _shaftLength, const float & _shaftRadius,
const float & _headLength, const float & _headRadius)
{
Expand Down

0 comments on commit 6ba22fa

Please sign in to comment.